Skip to content

Commit

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

* New translations sf45_rotating_lidar.md (Korean)

* New translations sf45_rotating_lidar.md (Turkish)

* New translations sf45_rotating_lidar.md (Ukrainian)

* New translations sf45_rotating_lidar.md (Chinese Simplified)

* New translations package_delivery_mission.md (Japanese)

* New translations package_delivery_mission.md (Korean)

* New translations package_delivery_mission.md (Turkish)

* New translations package_delivery_mission.md (Ukrainian)

* New translations package_delivery_mission.md (Chinese Simplified)

* New translations gripper.md (Japanese)

* New translations gripper.md (Korean)

* New translations gripper.md (Turkish)

* New translations gripper.md (Ukrainian)

* New translations gripper.md (Chinese Simplified)

* New translations main.md (Japanese)

* New translations main.md (Korean)

* New translations main.md (Turkish)

* New translations main.md (Ukrainian)

* New translations main.md (Chinese Simplified)

* New translations mission.md (Japanese)

* New translations mission.md (Korean)

* New translations mission.md (Turkish)

* New translations mission.md (Ukrainian)

* New translations mission.md (Chinese Simplified)

* New translations mission.md (Japanese)

* New translations mission.md (Korean)

* New translations mission.md (Turkish)

* New translations mission.md (Ukrainian)

* New translations mission.md (Chinese Simplified)

* New translations mission.md (Japanese)

* New translations mission.md (Korean)

* New translations mission.md (Turkish)

* New translations mission.md (Ukrainian)

* New translations mission.md (Chinese Simplified)

* New translations log_encryption.md (Japanese)

* New translations log_encryption.md (Korean)

* New translations log_encryption.md (Turkish)

* New translations log_encryption.md (Ukrainian)

* New translations log_encryption.md (Chinese Simplified)
  • Loading branch information
PX4BuildBot authored Dec 19, 2024
1 parent 1140acc commit 194a3e0
Show file tree
Hide file tree
Showing 40 changed files with 240 additions and 60 deletions.
2 changes: 1 addition & 1 deletion ja/dev_log/log_encryption.md
Original file line number Diff line number Diff line change
Expand Up @@ -103,7 +103,7 @@ The FMUv5 board already has a custom make target `px4-fmu-v5_cryptotest` that yo
The configuration file that enables the above make target is [`cryptotest.px4board`](https://github.com/PX4/PX4-Autopilot/blob/main/boards/px4/fmu-v5/cryptotest.px4board) file in `boards/px4/fmu-v5`.
The relevant keys in that file are reproduced below:

```config
```plain
CONFIG_BOARD_CRYPTO=y
CONFIG_DRIVERS_STUB_KEYSTORE=y
CONFIG_DRIVERS_SW_CRYPTO=y
Expand Down
15 changes: 13 additions & 2 deletions ja/flight_modes_fw/mission.md
Original file line number Diff line number Diff line change
Expand Up @@ -182,7 +182,6 @@ Rally Points

:::info
Please add an issue report or PR if you find a missing/incorrect message.
::: info:

- PX4 parses the above messages, but they are not necessary _acted_ on. For example, some messages are vehicle-type specific.
- PX4 does not support local frames for mission commands (e.g. [MAV_FRAME_LOCAL_NED](https://mavlink.io/en/messages/common.html#MAV_FRAME_LOCAL_NED)).
Expand All @@ -191,6 +190,18 @@ Please add an issue report or PR if you find a missing/incorrect message.
You can check the current set by inspecting the code.
Support is `MavlinkMissionManager::parse_mavlink_mission_item` in [/src/modules/mavlink/mavlink_mission.cpp](https://github.com/PX4/PX4-Autopilot/blob/main/src/modules/mavlink/mavlink_mission.cpp).

:::

## Mission Command Timeouts

Some mission commands/items can take time to complete, such as a gripper opening and closing, a winch extending or retracting, or a gimbal moving to point at a region of interest.

Where provided PX4 may use sensor feedback from the hardware to determine when the action has completed and then move to the next mission item.
If not provided, or if the feedback is lost, a mission command timeout can be used to ensure that these kinds of actions will progress to the next mission item rather than blocking progression.

The timeout is set using the [MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT) parameter.
This should be set to be a small amount greater than the time required for the longest long-running action in the mission to complete.

## Rounded turns: Inter-Waypoint Trajectory

PX4 expects to follow a straight line from the previous waypoint to the current target (it does not plan any other kind of path between waypoints - if you need one you can simulate this by adding additional waypoints).
Expand Down Expand Up @@ -226,7 +237,7 @@ When hand-launching the vehicle will arm, but only throttle up when the vehicle
In both cases, the vehicle should be placed (or launched) facing towards the takeoff waypoint when the mission is started.
If possible, always make the vehicle takeoff into the wind.

::: info
:::info
A fixed-wing mission requires a `Takeoff` mission item to takeoff; if however the vehicle is already flying when the mission is started the takeoff item will be treated as a normal waypoint.
:::

Expand Down
12 changes: 11 additions & 1 deletion ja/flight_modes_mc/mission.md
Original file line number Diff line number Diff line change
Expand Up @@ -19,7 +19,7 @@ The mission is typically created and uploaded with a Ground Control Station (GCS
## Description

Missions are usually created in a ground control station (e.g. [QGroundControl](https://docs.qgroundcontrol.com/master/en/qgc-user-guide/plan_view/plan_view.html)) and uploaded prior to launch.
They may also be created by a developer API, and/or uploaded in flight.
They may also be created by a MAVLink API such as [MAVSDK](../robotics/mavsdk.md), and/or uploaded in flight.

Individual [mission commands](#mission-commands) are handled in a way that is appropriate to multicopter flight characteristics (for example loiter is implemented as _hover_ ).

Expand Down Expand Up @@ -196,6 +196,16 @@ Please add an issue report or PR if you find a missing/incorrect message.

:::

## Mission Command Timeouts

Some mission commands/items can take time to complete, such as a gripper opening and closing, a winch extending or retracting, or a gimbal moving to point at a region of interest.

Where provided PX4 may use sensor feedback from the hardware to determine when the action has completed and then move to the next mission item.
If not provided, or if the feedback is lost, a mission command timeout can be used to ensure that these kinds of actions will progress to the next mission item rather than blocking progression.

The timeout is set using the [MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT) parameter.
This should be set to be a small amount greater than the time required for the longest long-running action in the mission to complete.

## Rounded turns: Inter-Waypoint Trajectory

PX4 expects to follow a straight line from the previous waypoint to the current target (it does not plan any other kind of path between waypoints - if you need one you can simulate this by adding additional waypoints).
Expand Down
10 changes: 10 additions & 0 deletions ja/flight_modes_vtol/mission.md
Original file line number Diff line number Diff line change
Expand Up @@ -30,6 +30,16 @@ In fixed-wing mode there are the following exceptions:
- [MAV_CMD_NAV_LAND](https://mavlink.io/en/messages/common.html#MAV_CMD_NAV_LAND) is transformed into [MAV_CMD_NAV_VTOL_LAND](https://mavlink.io/en/messages/common.html#MAV_CMD_NAV_VTOL_LAND) unless [NAV_FORCE_VT](../advanced_config/parameter_reference.md#NAV_FORCE_VT) is set to `0` (disabled).
- [MAV_CMD_NAV_TAKEOFF](https://mavlink.io/en/messages/common.html#MAV_CMD_NAV_TAKEOFF) is not supported.

## Mission Command Timeouts

Some mission commands/items can take time to complete, such as a gripper opening and closing, a winch extending or retracting, or a gimbal moving to point at a region of interest.

Where provided PX4 may use sensor feedback from the hardware to determine when the action has completed and then move to the next mission item.
If not provided, or if the feedback is lost, a mission command timeout can be used to ensure that these kinds of actions will progress to the next mission item rather than blocking progression.

The timeout is set using the [MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT) parameter.
This should be set to be a small amount greater than the time required for the longest long-running action in the mission to complete.

## Mission Takeoff

Plan a VTOL mission takeoff by adding a `VTOL Takeoff` mission item to the map.
Expand Down
2 changes: 1 addition & 1 deletion ja/flying/package_delivery_mission.md
Original file line number Diff line number Diff line change
Expand Up @@ -89,7 +89,7 @@ So if you land, release the cargo, then have an RTL waypoint, the vehicle will i
A gripper can be [manually controlled using a joystick button](../peripherals/gripper.md#qgc-joystick-configuration) (if configured) in any mode, including during a mission.

Note however that if you manually command the gripper to close while a package delivery mission is opening the gripper, the gripper won't be able to finish the open action.
The mission will resume after the payload delivery mission item timeout ([MIS_PD_TO](../advanced_config/parameter_reference.md#MIS_PD_TO) expires, even if it has not released the package.
The mission will resume after the mission command timeout ([MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT)) expires, even if it has not released the package.

#### Auto-disarming is Disabled in Missions

Expand Down
11 changes: 6 additions & 5 deletions ja/peripherals/gripper.md
Original file line number Diff line number Diff line change
Expand Up @@ -75,7 +75,7 @@ To set the actuation timeout:

- Run the `payload_deliverer` test in the QGC [MAVLink Shell](../debug/mavlink_shell.md):

```
```sh
> payload_deliverer gripper_test
```

Expand All @@ -89,20 +89,21 @@ To set the actuation timeout:

2. Set [PD_GRIPPER_TO](../advanced_config/parameter_reference.md#PD_GRIPPER_TO) to whichever of the gripper open and close time is larger.

### Mission Delivery Timeout
### Mission Command Timeout

When running a [Payload Delivery Mission](../flying/package_delivery_mission.md) it is important that the mission is not halted in the case where the gripper does not report that it has opened (or closed).
This might happen if a gripper feedback sensor was damaged or UORB dropped the gripper actuator timout message.
This might happen if a gripper does not have a feedback sensor, if the feedback sensor was damaged, or if UORB dropped the gripper actuator timeout message.

:::info
Gripper state feedback from a sensor is not actually supported yet, but it may be in future.
:::

The mission-delivery timout provides an additional safeguard, continuing the mission if the gripper's successful actuation acknowledgement is not received.
The mission command timeout provides an additional safeguard, continuing the mission if the gripper's successful actuation acknowledgement is not received.
This timeout is also used to provide a sufficient delay for other commands to complete in the case where sensor feedback is not provided or received, such as for winch deployment/retraction, and gimbal movement to a mission-commanded orientation.
To set the timeout:
1. Set [MIS_PD_TO](../advanced_config/parameter_reference.md#MIS_PD_TO) to a value greater than the [gripper actuation timeout](#gripper-actuation-timeout).
1. Set [MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT) to a value greater than the [gripper actuation timeout](#gripper-actuation-timeout).
## QGC Joystick Configuration
Expand Down
4 changes: 4 additions & 0 deletions ja/releases/main.md
Original file line number Diff line number Diff line change
Expand Up @@ -37,6 +37,10 @@ Please continue reading for [upgrade instructions](#upgrade-guide).
- [Log Encryption](../dev_log/log_encryption.md) now generates an encrypted log that contains the public-key-encrypted symmetric key that can be used to decrypt it, instead of putting the key into a separate file.
This makes log decryption much easier, as there is no need to download or identify a separate key file.
([PX4-Autopilot#24024](https://github.com/PX4/PX4-Autopilot/pull/24024)).
- The generic mission command timeout [MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT) parameter replaces the delivery-specific `MIS_PD_TO` parameter.
Mission commands that may take some time to complete, such as those for controlling gimbals, winches, and grippers, will progress to the next item when either feedback is received or the timeout expires.
This is often used to provide a minimum delay for hardware that does not provide completion feedback, so that it can reach the commanded state before the mission progresses.
([PX4-Autopilot#23960](https://github.com/PX4/PX4-Autopilot/pull/23960)).

### Control

Expand Down
4 changes: 2 additions & 2 deletions ja/sensor/sf45_rotating_lidar.md
Original file line number Diff line number Diff line change
Expand Up @@ -94,13 +94,13 @@ The [Plotting Obstacle Distance and Minimum Distance in Real-Time with PlotJuggl

**Global code, executed once:**

```reactive
```lua
obs_dist_xy = ScatterXY.new("obstacle_distance_xy")
```

**function(tracker_time)**

```reactive
```lua
obs_dist_xy:clear()

i = 0
Expand Down
2 changes: 1 addition & 1 deletion ko/dev_log/log_encryption.md
Original file line number Diff line number Diff line change
Expand Up @@ -103,7 +103,7 @@ The FMUv5 board already has a custom make target `px4-fmu-v5_cryptotest` that yo
The configuration file that enables the above make target is [`cryptotest.px4board`](https://github.com/PX4/PX4-Autopilot/blob/main/boards/px4/fmu-v5/cryptotest.px4board) file in `boards/px4/fmu-v5`.
The relevant keys in that file are reproduced below:

```config
```plain
CONFIG_BOARD_CRYPTO=y
CONFIG_DRIVERS_STUB_KEYSTORE=y
CONFIG_DRIVERS_SW_CRYPTO=y
Expand Down
15 changes: 13 additions & 2 deletions ko/flight_modes_fw/mission.md
Original file line number Diff line number Diff line change
Expand Up @@ -182,7 +182,6 @@ Rally Points

:::info
Please add an issue report or PR if you find a missing/incorrect message.
::: info:

- PX4 parses the above messages, but they are not necessary _acted_ on. For example, some messages are vehicle-type specific.
- PX4 does not support local frames for mission commands (e.g. [MAV_FRAME_LOCAL_NED](https://mavlink.io/en/messages/common.html#MAV_FRAME_LOCAL_NED)).
Expand All @@ -191,6 +190,18 @@ Please add an issue report or PR if you find a missing/incorrect message.
You can check the current set by inspecting the code.
Support is `MavlinkMissionManager::parse_mavlink_mission_item` in [/src/modules/mavlink/mavlink_mission.cpp](https://github.com/PX4/PX4-Autopilot/blob/main/src/modules/mavlink/mavlink_mission.cpp).

:::

## Mission Command Timeouts

Some mission commands/items can take time to complete, such as a gripper opening and closing, a winch extending or retracting, or a gimbal moving to point at a region of interest.

Where provided PX4 may use sensor feedback from the hardware to determine when the action has completed and then move to the next mission item.
If not provided, or if the feedback is lost, a mission command timeout can be used to ensure that these kinds of actions will progress to the next mission item rather than blocking progression.

The timeout is set using the [MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT) parameter.
This should be set to be a small amount greater than the time required for the longest long-running action in the mission to complete.

## Rounded turns: Inter-Waypoint Trajectory

PX4 expects to follow a straight line from the previous waypoint to the current target (it does not plan any other kind of path between waypoints - if you need one you can simulate this by adding additional waypoints).
Expand Down Expand Up @@ -226,7 +237,7 @@ When hand-launching the vehicle will arm, but only throttle up when the vehicle
In both cases, the vehicle should be placed (or launched) facing towards the takeoff waypoint when the mission is started.
If possible, always make the vehicle takeoff into the wind.

::: info
:::info
A fixed-wing mission requires a `Takeoff` mission item to takeoff; if however the vehicle is already flying when the mission is started the takeoff item will be treated as a normal waypoint.
:::

Expand Down
12 changes: 11 additions & 1 deletion ko/flight_modes_mc/mission.md
Original file line number Diff line number Diff line change
Expand Up @@ -19,7 +19,7 @@ The mission is typically created and uploaded with a Ground Control Station (GCS
## 설명

Missions are usually created in a ground control station (e.g. [QGroundControl](https://docs.qgroundcontrol.com/master/en/qgc-user-guide/plan_view/plan_view.html)) and uploaded prior to launch.
They may also be created by a developer API, and/or uploaded in flight.
They may also be created by a MAVLink API such as [MAVSDK](../robotics/mavsdk.md), and/or uploaded in flight.

Individual [mission commands](#mission-commands) are handled in a way that is appropriate to multicopter flight characteristics (for example loiter is implemented as _hover_ ).

Expand Down Expand Up @@ -196,6 +196,16 @@ Please add an issue report or PR if you find a missing/incorrect message.

:::

## Mission Command Timeouts

Some mission commands/items can take time to complete, such as a gripper opening and closing, a winch extending or retracting, or a gimbal moving to point at a region of interest.

Where provided PX4 may use sensor feedback from the hardware to determine when the action has completed and then move to the next mission item.
If not provided, or if the feedback is lost, a mission command timeout can be used to ensure that these kinds of actions will progress to the next mission item rather than blocking progression.

The timeout is set using the [MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT) parameter.
This should be set to be a small amount greater than the time required for the longest long-running action in the mission to complete.

## Rounded turns: Inter-Waypoint Trajectory

PX4 expects to follow a straight line from the previous waypoint to the current target (it does not plan any other kind of path between waypoints - if you need one you can simulate this by adding additional waypoints).
Expand Down
10 changes: 10 additions & 0 deletions ko/flight_modes_vtol/mission.md
Original file line number Diff line number Diff line change
Expand Up @@ -30,6 +30,16 @@ In fixed-wing mode there are the following exceptions:
- [MAV_CMD_NAV_LAND](https://mavlink.io/en/messages/common.html#MAV_CMD_NAV_LAND) is transformed into [MAV_CMD_NAV_VTOL_LAND](https://mavlink.io/en/messages/common.html#MAV_CMD_NAV_VTOL_LAND) unless [NAV_FORCE_VT](../advanced_config/parameter_reference.md#NAV_FORCE_VT) is set to `0` (disabled).
- [MAV_CMD_NAV_TAKEOFF](https://mavlink.io/en/messages/common.html#MAV_CMD_NAV_TAKEOFF) is not supported.

## Mission Command Timeouts

Some mission commands/items can take time to complete, such as a gripper opening and closing, a winch extending or retracting, or a gimbal moving to point at a region of interest.

Where provided PX4 may use sensor feedback from the hardware to determine when the action has completed and then move to the next mission item.
If not provided, or if the feedback is lost, a mission command timeout can be used to ensure that these kinds of actions will progress to the next mission item rather than blocking progression.

The timeout is set using the [MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT) parameter.
This should be set to be a small amount greater than the time required for the longest long-running action in the mission to complete.

## Mission Takeoff

Plan a VTOL mission takeoff by adding a `VTOL Takeoff` mission item to the map.
Expand Down
2 changes: 1 addition & 1 deletion ko/flying/package_delivery_mission.md
Original file line number Diff line number Diff line change
Expand Up @@ -89,7 +89,7 @@ So if you land, release the cargo, then have an RTL waypoint, the vehicle will i
A gripper can be [manually controlled using a joystick button](../peripherals/gripper.md#qgc-joystick-configuration) (if configured) in any mode, including during a mission.

Note however that if you manually command the gripper to close while a package delivery mission is opening the gripper, the gripper won't be able to finish the open action.
The mission will resume after the payload delivery mission item timeout ([MIS_PD_TO](../advanced_config/parameter_reference.md#MIS_PD_TO) expires, even if it has not released the package.
The mission will resume after the mission command timeout ([MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT)) expires, even if it has not released the package.

#### Auto-disarming is Disabled in Missions

Expand Down
11 changes: 6 additions & 5 deletions ko/peripherals/gripper.md
Original file line number Diff line number Diff line change
Expand Up @@ -75,7 +75,7 @@ To set the actuation timeout:

- Run the `payload_deliverer` test in the QGC [MAVLink Shell](../debug/mavlink_shell.md):

```
```sh
> payload_deliverer gripper_test
```

Expand All @@ -89,20 +89,21 @@ To set the actuation timeout:

2. Set [PD_GRIPPER_TO](../advanced_config/parameter_reference.md#PD_GRIPPER_TO) to whichever of the gripper open and close time is larger.

### Mission Delivery Timeout
### Mission Command Timeout

When running a [Payload Delivery Mission](../flying/package_delivery_mission.md) it is important that the mission is not halted in the case where the gripper does not report that it has opened (or closed).
This might happen if a gripper feedback sensor was damaged or UORB dropped the gripper actuator timout message.
This might happen if a gripper does not have a feedback sensor, if the feedback sensor was damaged, or if UORB dropped the gripper actuator timeout message.

:::info
Gripper state feedback from a sensor is not actually supported yet, but it may be in future.
:::

The mission-delivery timout provides an additional safeguard, continuing the mission if the gripper's successful actuation acknowledgement is not received.
The mission command timeout provides an additional safeguard, continuing the mission if the gripper's successful actuation acknowledgement is not received.
This timeout is also used to provide a sufficient delay for other commands to complete in the case where sensor feedback is not provided or received, such as for winch deployment/retraction, and gimbal movement to a mission-commanded orientation.
To set the timeout:
1. Set [MIS_PD_TO](../advanced_config/parameter_reference.md#MIS_PD_TO) to a value greater than the [gripper actuation timeout](#gripper-actuation-timeout).
1. Set [MIS_COMMAND_TOUT](../advanced_config/parameter_reference.md#MIS_COMMAND_TOUT) to a value greater than the [gripper actuation timeout](#gripper-actuation-timeout).
## QGC Joystick Configuration
Expand Down
Loading

0 comments on commit 194a3e0

Please sign in to comment.