Skip to content

Commit

Permalink
New Crowdin updates (#3486)
Browse files Browse the repository at this point in the history
* New translations offboard.md (Japanese)

* New translations offboard.md (Korean)

* New translations offboard.md (Turkish)

* New translations offboard.md (Ukrainian)

* New translations offboard.md (Chinese Simplified)

* New translations index.md (Japanese)

* New translations index.md (Korean)

* New translations index.md (Turkish)

* New translations index.md (Ukrainian)

* New translations index.md (Chinese Simplified)

* New translations rtk_gps.md (Japanese)

* New translations rtk_gps.md (Korean)

* New translations rtk_gps.md (Turkish)

* New translations rtk_gps.md (Ukrainian)

* New translations rtk_gps.md (Chinese Simplified)

* New translations septentrio_mosaic-go.md (Japanese)

* New translations septentrio_mosaic-go.md (Korean)

* New translations septentrio_mosaic-go.md (Turkish)

* New translations septentrio_mosaic-go.md (Ukrainian)

* New translations septentrio_mosaic-go.md (Chinese Simplified)

* New translations magnetometer.md (Japanese)

* New translations magnetometer.md (Korean)

* New translations magnetometer.md (Turkish)

* New translations magnetometer.md (Ukrainian)

* New translations magnetometer.md (Chinese Simplified)

* New translations dev_env.md (Japanese)

* New translations dev_env.md (Korean)

* New translations dev_env.md (Turkish)

* New translations dev_env.md (Ukrainian)

* New translations dev_env.md (Chinese Simplified)

* New translations summary.md (Japanese)

* New translations summary.md (Korean)

* New translations summary.md (Turkish)

* New translations summary.md (Ukrainian)

* New translations summary.md (Chinese Simplified)

* New translations cm8jl65_ir_distance_sensor.md (Japanese)

* New translations cm8jl65_ir_distance_sensor.md (Korean)

* New translations cm8jl65_ir_distance_sensor.md (Turkish)

* New translations cm8jl65_ir_distance_sensor.md (Ukrainian)

* New translations cm8jl65_ir_distance_sensor.md (Chinese Simplified)

* New translations pmw3901.md (Japanese)

* New translations pmw3901.md (Korean)

* New translations pmw3901.md (Turkish)

* New translations pmw3901.md (Ukrainian)

* New translations pmw3901.md (Chinese Simplified)

* New translations rangefinders.md (Japanese)

* New translations rangefinders.md (Korean)

* New translations rangefinders.md (Turkish)

* New translations rangefinders.md (Ukrainian)

* New translations rangefinders.md (Chinese Simplified)

* New translations thunderfly_tachometer.md (Ukrainian)

* New translations thunderfly_tachometer.md (Chinese Simplified)

* New translations index.md (Korean)

* New translations index.md (Ukrainian)

* New translations index.md (Chinese Simplified)

* New translations collision_prevention.md (Korean)

* New translations collision_prevention.md (Ukrainian)

* New translations collision_prevention.md (Chinese Simplified)

* New translations mavlink_shell.md (Korean)

* New translations mavlink_shell.md (Ukrainian)

* New translations mavlink_shell.md (Chinese Simplified)

* New translations ark_pi6x.md (Ukrainian)
  • Loading branch information
PX4BuildBot authored Dec 11, 2024
1 parent 7134938 commit c5a079a
Show file tree
Hide file tree
Showing 62 changed files with 549 additions and 509 deletions.
2 changes: 1 addition & 1 deletion ja/SUMMARY.md
Original file line number Diff line number Diff line change
Expand Up @@ -247,7 +247,7 @@
- [Benewake TFmini Lidar](sensor/tfmini.md)
- [Lidar-Lite](sensor/lidar_lite.md)
- [TeraRanger](sensor/teraranger.md)
- [Lanbao PSK-CM8JL65-CC5](sensor/cm8jl65_ir_distance_sensor.md)
- [Lanbao PSK-CM8JL65-CC5](sensor/cm8jl65_ir_distance_sensor.md)
- [Avionics Anonymous Laser Altimeter UAVCAN Interface (CAN)](dronecan/avanon_laser_interface.md)
- [GNSS (GPS)](gps_compass/index.md)
- [ARK GPS (CAN)](dronecan/ark_gps.md)
Expand Down
16 changes: 8 additions & 8 deletions ja/dev_setup/dev_env.md
Original file line number Diff line number Diff line change
Expand Up @@ -10,14 +10,14 @@ The _supported platforms_ for PX4 development are:

The table below shows what PX4 targets you can build on each OS.

| Target | Linux (Ubuntu) | Mac | Windows |
| ------------------------------------------------------------------------------------------------------------------------------------------------------ | :-------------------------------: | :-----------------------------: | :-----------------------------: |
| **NuttX based hardware:** [Pixhawk Series](../flight_controller/pixhawk_series.md), [Crazyflie](../complete_vehicles_mc/crazyflie2.md) | ✓ | ✓ | ✓ |
| **Linux-based hardware:** [Raspberry Pi 2/3](../flight_controller/raspberry_pi_navio2.md) | ✓ | | |
| **Simulation:** [Gazebo SITL](../sim_gazebo_gz/index.md) | ✓ | ✓ | ✓ |
| **Simulation:** [Gazebo Classic SITL](../sim_gazebo_classic/index.md) | ✓ | ✓ | ✓ |
| **Simulation:** [ROS with Gazebo Classic](../simulation/ros_interface.md) | ✓ | | ✓ |
| **Simulation:** ROS 2 with Gazebo | ✓ | | ✓ |
| Target | Linux (Ubuntu) | Mac | Windows |
| ------------------------------------------------------------------------------------------------------------------------------------------------------ | :-------------------------------: | :-: | :-----: |
| **NuttX based hardware:** [Pixhawk Series](../flight_controller/pixhawk_series.md), [Crazyflie](../complete_vehicles_mc/crazyflie2.md) | || |
| **Linux-based hardware:** [Raspberry Pi 2/3](../flight_controller/raspberry_pi_navio2.md) | | | |
| **Simulation:** [Gazebo SITL](../sim_gazebo_gz/index.md) | || |
| **Simulation:** [Gazebo Classic SITL](../sim_gazebo_classic/index.md) | || |
| **Simulation:** [ROS with Gazebo Classic](../simulation/ros_interface.md) | | | |
| **Simulation:** ROS 2 with Gazebo | | | |

Experienced Docker users can also build with the containers used by our continuous integration system: [Docker Containers](../test_and_ci/docker.md)

Expand Down
3 changes: 2 additions & 1 deletion ja/flight_modes/offboard.md
Original file line number Diff line number Diff line change
Expand Up @@ -76,7 +76,7 @@ For example, if the `acceleration` field is the first non-zero value, then PX4 r
| thrust and torque (FRD) ||||||| - | none | [VehicleThrustSetpoint](../msg_docs/VehicleThrustSetpoint.md) and [VehicleTorqueSetpoint](../msg_docs/VehicleTorqueSetpoint.md) |
| direct motors and servos |||||||| none | [ActuatorMotors](../msg_docs/ActuatorMotors.md) and [ActuatorServos](../msg_docs/ActuatorServos.md) |

where ✓ means that the bit is set, ✗ means that the bit is not set and `-` means that the bit is value is irrelevant.
where means that the bit is set, means that the bit is not set and `-` means that the bit is value is irrelevant.

:::info
Before using offboard mode with ROS 2, please spend a few minutes understanding the different [frame conventions](../ros2/user_guide.md#ros-2-px4-frame-conventions) that PX4 and ROS 2 use.
Expand All @@ -87,6 +87,7 @@ Before using offboard mode with ROS 2, please spend a few minutes understanding
- [px4_msgs::msg::TrajectorySetpoint](https://github.com/PX4/PX4-Autopilot/blob/main/msg/TrajectorySetpoint.msg)

- The following input combinations are supported:

- Position setpoint (`position` different from `NaN`). Non-`NaN` values of velocity and acceleration are used as feedforward terms for the inner loop controllers.
- Velocity setpoint (`velocity` different from `NaN` and `position` set to `NaN`). Non-`NaN` values acceleration are used as feedforward terms for the inner loop controllers.
- Acceleration setpoint (`acceleration` different from `NaN` and `position` and `velocity` set to `NaN`)
Expand Down
54 changes: 27 additions & 27 deletions ja/gps_compass/index.md
Original file line number Diff line number Diff line change
Expand Up @@ -22,31 +22,31 @@ PX4 should work with any unit that communicates via the u-blox, MTK Ashtech or E
This table contains non-RTK GNSS units (most of which also have a compass).
These have been tested by the PX4 dev team, or which are popular within the PX4 community.

| Device | GPS | Compass | [CAN](../dronecan/index.md) | Buzzer / SafeSw / LED | Notes |
| :----------------------------------------------------------- | :-----------------------------: | :-----------------------------: | :-----------------------------: | :-------------------------------------------------------------------------------------------: | :---------------------------------------------------------- |
| [ARK GPS](../dronecan/ark_gps.md) | M9N | BMM150 | ✓ | ✓ | + Baro, IMU |
| [ARK TESEO GPS](../dronecan/ark_teseo_gps.md) | Teseo-LIV4F | BMM150 | ✓ | ✓ | + Baro, IMU |
| [Avionics Anonymous UAVCAN GNSS/Mag][avionics_anon_can_gnss] | SAM-M8Q | MMC5983MA | ✓ | ✗ | |
| [CUAV NEO 3 GPS](../gps_compass/gps_cuav_neo_3.md) | M9N | IST8310 | | ✓ | |
| [CUAV NEO 3 Pro GPS](../gps_compass/gps_cuav_neo_3pro.md) | M9N | RM3100 | ✓ | ✓ | + Baro |
| [CUAV NEO 3X GPS](../gps_compass/gps_cuav_neo_3x.md) | M9N | RM3100 | ✓ | ✗✓✓ | + Baro. |
| [CubePilot Here2 GNSS GPS (M8N)][CubePilot Here2] | M8N | ICM20948 | | ✓ | Superseded by HERE3 |
| [Emlid Reach M+](https://emlid.com/reach/) | ✓ | ✗ | | ✗ | Supports PPK. RTK expected. |
| [Holybro DroneCAN M8N GPS](../dronecan/holybro_m8n_gps.md) | M8N | BMM150 | ✓ | ✗ | + Baro |
| [Holybro Micro M8N GPS][Hb Micro M8N] | M8N | IST8310 | | ✗ | |
| [Holybro Nano Ublox M8 5883 GPS][hb_nano_m8_5883] | UBX-M8030 | QMC5883 | | ✗ | |
| [Holybro M8N GPS](../gps_compass/gps_holybro_m8n_m9n.md) | M8N | IST8310 | | ✓ | |
| [Holybro M9N GPS](../gps_compass/gps_holybro_m8n_m9n.md) | M9N | IST8310 | | ✓ | |
| [Holybro DroneCAN M9N GPS][hb_can_m9n] | M9N | BMM150 | ✓ | ✓ | |
| [Holybro M10 GPS][hb_m10] | M10 | IST8310 | | ✓ | |
| [Hobbyking u-blox Neo-M8N GPS & Compass][hk_ublox_neo_8mn] | M8N | ✓ | | ✗ | |
| [LOCOSYS Hawk A1 GNSS receiver][LOCOSYS Hawk A1] | MC-1612-V2b | optional | | ✗✗✓ | |
| [LOCOSYS Hawk R1](../gps_compass/rtk_gps_locosys_r1.md) | MC-1612-V2b | | | ✗✗✓ | |
| [LOCOSYS Hawk R2](../gps_compass/rtk_gps_locosys_r2.md) | MC-1612-V2b | IST8310 | | ✗✗✓ | |
| [mRo GPS u-blox Neo-M8N Dual Compass][mro_neo8mn_dual_mag] | M8N | LIS3MDL, IST8308 | | ✗ | |
| [RaccoonLab L1 GNSS NEO-M8N][RccnLabGNSS250] | NEO-M8N | RM3100 | ✓ | ✗✗✓ | + Baro |
| [Sky-Drones SmartAP GPS](../gps_compass/gps_smartap.md) | M8N | HMC5983, IST8310, LIS3MDL | | ✓ | + Baro |
| [Zubax GNSS 2](https://zubax.com/products/gnss_2) | MAX-M8Q | LIS3MDL | | ✗ | + Baro |
| Device | GPS | Compass | [CAN](../dronecan/index.md) | Buzzer / SafeSw / LED | Notes |
| :----------------------------------------------------------- | :---------: | :-----------------------: | :-------------------------: | :-------------------: | :---------------------------------------------------------- |
| [ARK GPS](../dronecan/ark_gps.md) | M9N | BMM150 | | | + Baro, IMU |
| [ARK TESEO GPS](../dronecan/ark_teseo_gps.md) | Teseo-LIV4F | BMM150 | | | + Baro, IMU |
| [Avionics Anonymous UAVCAN GNSS/Mag][avionics_anon_can_gnss] | SAM-M8Q | MMC5983MA | | | |
| [CUAV NEO 3 GPS](../gps_compass/gps_cuav_neo_3.md) | M9N | IST8310 | | | |
| [CUAV NEO 3 Pro GPS](../gps_compass/gps_cuav_neo_3pro.md) | M9N | RM3100 | | | + Baro |
| [CUAV NEO 3X GPS](../gps_compass/gps_cuav_neo_3x.md) | M9N | RM3100 | | ✘✓✓ | + Baro. |
| [CubePilot Here2 GNSS GPS (M8N)][CubePilot Here2] | M8N | ICM20948 | | | Superseded by HERE3 |
| [Emlid Reach M+](https://emlid.com/reach/) | | | | | Supports PPK. RTK expected. |
| [Holybro DroneCAN M8N GPS](../dronecan/holybro_m8n_gps.md) | M8N | BMM150 | | | + Baro |
| [Holybro Micro M8N GPS][Hb Micro M8N] | M8N | IST8310 | | | |
| [Holybro Nano Ublox M8 5883 GPS][hb_nano_m8_5883] | UBX-M8030 | QMC5883 | | | |
| [Holybro M8N GPS](../gps_compass/gps_holybro_m8n_m9n.md) | M8N | IST8310 | | | |
| [Holybro M9N GPS](../gps_compass/gps_holybro_m8n_m9n.md) | M9N | IST8310 | | | |
| [Holybro DroneCAN M9N GPS][hb_can_m9n] | M9N | BMM150 | | | |
| [Holybro M10 GPS][hb_m10] | M10 | IST8310 | | | |
| [Hobbyking u-blox Neo-M8N GPS & Compass][hk_ublox_neo_8mn] | M8N | | | | |
| [LOCOSYS Hawk A1 GNSS receiver][LOCOSYS Hawk A1] | MC-1612-V2b | optional | | ✘✘✓ | |
| [LOCOSYS Hawk R1](../gps_compass/rtk_gps_locosys_r1.md) | MC-1612-V2b | | | ✘✘✓ | |
| [LOCOSYS Hawk R2](../gps_compass/rtk_gps_locosys_r2.md) | MC-1612-V2b | IST8310 | | ✘✘✓ | |
| [mRo GPS u-blox Neo-M8N Dual Compass][mro_neo8mn_dual_mag] | M8N | LIS3MDL, IST8308 | | | |
| [RaccoonLab L1 GNSS NEO-M8N][RccnLabGNSS250] | NEO-M8N | RM3100 | | ✘✘✓ | + Baro |
| [Sky-Drones SmartAP GPS](../gps_compass/gps_smartap.md) | M8N | HMC5983, IST8310, LIS3MDL | | | + Baro |
| [Zubax GNSS 2](https://zubax.com/products/gnss_2) | MAX-M8Q | LIS3MDL | | | + Baro |

<!-- links to improve layout of table for editing -->

Expand All @@ -63,9 +63,9 @@ These have been tested by the PX4 dev team, or which are popular within the PX4

Notes:

- &check; or a specific part number indicate that a features is supported, while &cross; or empty show that the feature is not supported.
- or a specific part number indicate that a features is supported, while or empty show that the feature is not supported.
"?" indicates "unknown".
- Where possible and relevant the part name is used (i.e. &check; in the GPS column indicates that a GPS module is present but the part is not known).
- Where possible and relevant the part name is used (i.e. in the GPS column indicates that a GPS module is present but the part is not known).
- The list may omit some discontinued hardware that is still supported (check earlier versions for info about discontinued modules).
Removed items include:
- _Here_ GPS
Expand Down
Loading

0 comments on commit c5a079a

Please sign in to comment.