Skip to content

Commit

Permalink
New Crowdin updates (#1712)
Browse files Browse the repository at this point in the history
* New translations px4_basic_concepts.md (German)

* New translations px4_basic_concepts.md (Japanese)

* New translations px4_basic_concepts.md (Korean)

* New translations px4_basic_concepts.md (Russian)

* New translations px4_basic_concepts.md (Turkish)

* New translations px4_basic_concepts.md (Chinese Simplified)

* New translations SUMMARY.md (German)

* New translations rtk_gps.md (Chinese Simplified)

* New translations README.md (Turkish)

* New translations rtk_gps.md (Turkish)

* New translations u-blox_f9p_heading.md (Turkish)

* New translations README.md (Turkish)

* New translations SUMMARY.md (Chinese Simplified)

* New translations README.md (Chinese Simplified)

* New translations u-blox_f9p_heading.md (Chinese Simplified)

* New translations README.md (Russian)

* New translations README.md (Chinese Simplified)

* New translations ark_rtk_gps.md (German)

* New translations ark_rtk_gps.md (Japanese)

* New translations ark_rtk_gps.md (Korean)

* New translations ark_rtk_gps.md (Russian)

* New translations ark_rtk_gps.md (Turkish)

* New translations SUMMARY.md (Turkish)

* New translations u-blox_f9p_heading.md (Russian)

* New translations README.md (German)

* New translations u-blox_f9p_heading.md (Japanese)

* New translations rtk_gps.md (German)

* New translations u-blox_f9p_heading.md (German)

* New translations README.md (German)

* New translations SUMMARY.md (Japanese)

* New translations README.md (Japanese)

* New translations rtk_gps.md (Japanese)

* New translations README.md (Japanese)

* New translations rtk_gps.md (Russian)

* New translations SUMMARY.md (Korean)

* New translations README.md (Korean)

* New translations rtk_gps.md (Korean)

* New translations u-blox_f9p_heading.md (Korean)

* New translations README.md (Korean)

* New translations SUMMARY.md (Russian)

* New translations README.md (Russian)

* New translations ark_rtk_gps.md (Chinese Simplified)

* New translations px4_basic_concepts.md (Korean)
  • Loading branch information
PX4BuildBot committed Dec 21, 2021
1 parent a00bba8 commit 99d1121
Show file tree
Hide file tree
Showing 42 changed files with 892 additions and 52 deletions.
1 change: 1 addition & 0 deletions de/SUMMARY.md
Original file line number Diff line number Diff line change
Expand Up @@ -214,6 +214,7 @@
* [ARK GPS](uavcan/ark_gps.md)
* [Hex Here2](gps_compass/gps_hex_here2.md)
* [RTK GPS](gps_compass/rtk_gps.md)
* [ARK RTK GPS](uavcan/ark_rtk_gps.md)
* [RTK GPS Heading with Dual u-blox F9P](gps_compass/u-blox_f9p_heading.md)
* [CUAV C-RTK](gps_compass/rtk_gps_cuav_c-rtk.md)
* [Drotek XL](gps_compass/rtk_gps_drotek_xl.md)
Expand Down
2 changes: 1 addition & 1 deletion de/getting_started/px4_basic_concepts.md
Original file line number Diff line number Diff line change
Expand Up @@ -233,7 +233,7 @@ All the vehicles, boats and aircraft have a heading direction or an orientation
![Frame Heading](../../assets/concepts/frame_heading.png)

:::note
For a VTOL Tailsitter the heading is relative to the multirotor configuration (i.e. vehicle pose during, takeoff, hovering, landing).
For a VTOL Tailsitter the heading is relative to the multirotor configuration (i.e. vehicle pose during takeoff, hovering, landing).
:::

It is important to know the vehicle heading direction in order to align the autopilot with the vehicle vector of movement. Multicopters have a heading even when they are symmetrical from all sides! Usually manufacturers use a colored props or colored arms to indicate the heading.
Expand Down
3 changes: 2 additions & 1 deletion de/gps_compass/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -19,6 +19,7 @@ PX4 should work with any unit that communicates via the u-blox, MTK Ashtech or E
| Device | GPS | Compass | [RTK](../gps_compass/rtk_gps.md) | [GPS Yaw Output](#configuring-gps-as-yaw-heading-source) | [Dual F9P GPS Heading](../gps_compass/u-blox_f9p_heading.md) |
|:------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------- |:------------:|:----------------:|:--------------------------------:|:--------------------------------------------------------:|:------------------------------------------------------------:|
| [ARK GPS](https://arkelectron.com/product/ark-gps/) | M9N | ICM42688p | | | |
| [ARK RTK GPS](https://arkelectron.com/product/ark-rtk-gps/) | F9P | ICM42688p | ✓ | | ✓ |
| [Avionics Anonymous UAVCAN GNSS/Mag](https://www.tindie.com/products/avionicsanonymous/uavcan-gps-magnetometer/) | SAM-M8Q | MMC5983MA | | | |
| [Avionics Anonymous UAVCAN Magnetometer](https://www.tindie.com/products/avionicsanonymous/uavcan-magnetometer/) | ✗ | ✓ | | | |
| [CUAV C-RTK GPS](../gps_compass/rtk_gps_cuav_c-rtk.md) | M8P/M8N | ✓ | ✓ | | |
Expand Down Expand Up @@ -59,7 +60,7 @@ Instructions for connecting the GPS (and compass, if present) are usually provid

[Pixhawk Series](../flight_controller/pixhawk_series.md) controllers typically have a clearly labeled port for connecting the GPS, and the compass is connected to either the I2C or SPI port/bus (depending on the device).

The [Zubax GNSS 2](https://zubax.com/products/gnss_2), [CubePilot Here3 CAN GNSS GPS (M8N)](https://www.cubepilot.org/#/here/here3), and [Avionics Anonymous GNSS/Mag](https://www.tindie.com/products/avionicsanonymous/uavcan-gps-magnetometer/) can also be connected via [UAVCAN](../uavcan/README.md).
The [ARK GPS](../uavcan/ark_gps.md), [ARK RTK GPS](../uavcan/ark_rtk_gps.md), [Zubax GNSS 2](https://zubax.com/products/gnss_2), [CubePilot Here3 CAN GNSS GPS (M8N)](https://www.cubepilot.org/#/here/here3), and [Avionics Anonymous GNSS/Mag](https://www.tindie.com/products/avionicsanonymous/uavcan-gps-magnetometer/) can also be connected via [UAVCAN](../uavcan/README.md).

:::warning
Pay attention to pinout when connecting the GPS module. While these are all software-compatible, there are several different pin orderings.
Expand Down
1 change: 1 addition & 0 deletions de/gps_compass/rtk_gps.md
Original file line number Diff line number Diff line change
Expand Up @@ -17,6 +17,7 @@ The RTK compatible devices below that are expected to work with PX4 (it omits di

| GPS | Yaw Output | [Dual FP9 GPS Heading](../gps_compass/u-blox_f9p_heading.md) | [CAN](../uavcan/README.md) |
|:--------------------------------------------------------------------------------------------------------------------------- |:----------:|:------------------------------------------------------------:|:--------------------------:|
| [ARK RTK GPS](../uavcan/ark_rtk_gps.md) | | ✓ | ✓ |
| [CUAV C-RTK GPS](../gps_compass/rtk_gps_cuav_c-rtk.md) | | | |
| [Drotek XL RTK GPS](../gps_compass/rtk_gps_drotek_xl.md) | | | |
| [Femtones MINI2 Receiver](../gps_compass/rtk_gps_fem_mini2.md) | | | |
Expand Down
1 change: 1 addition & 0 deletions de/gps_compass/u-blox_f9p_heading.md
Original file line number Diff line number Diff line change
Expand Up @@ -7,6 +7,7 @@ Two u-blox F9P [RTK GPS](../gps_compass/rtk_gps.md) modules mounted on a vehicle
This feature works on F9P devices that expose the GPS UART2 port (access to the port is required for setup).

The following devices are supported for this use case:
* [ARK RTK GPS](https://arkelectron.com/product/ark-rtk-gps/) (arkelectron.com)
* [SparkFun GPS-RTK2 Board - ZED-F9P](https://www.sparkfun.com/products/15136) (www.sparkfun.com)
* [SIRIUS RTK GNSS ROVER (F9P)](https://store-drotek.com/911-1010-sirius-rtk-gnss-rover-f9p.html#/158-sensor-no_magnetometer) (store-drotek.com)
* [mRo u-blox ZED-F9 RTK L1/L2 GPS](https://store.mrobotics.io/product-p/m10020d.htm) (store.mrobotics.io)
Expand Down
2 changes: 2 additions & 0 deletions de/uavcan/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -13,6 +13,8 @@ It supports hardware like:
- Airspeed sensors
- [Thiemar airspeed sensor](https://github.com/thiemar/airspeed)
- GNSS receivers for GPS and GLONASS
- [ARK GPS](../uavcan/ark_gps.md)
- [ARK RTK GPS](../uavcan/ark_rtk_gps.md)
- [CubePilot Here3](https://www.cubepilot.org/#/here/here3)
- [Zubax GNSS](https://zubax.com/products/gnss_2)
- Power monitors
Expand Down
134 changes: 134 additions & 0 deletions de/uavcan/ark_rtk_gps.md
Original file line number Diff line number Diff line change
@@ -0,0 +1,134 @@
# ARK RTK GPS

ARK RTK GPS is an open source [UAVCAN](README.md) [RTK GPS](../gps_compass/rtk_gps.md), [u-blox F9P](https://www.u-blox.com/en/product/zed-f9p-module), magnetometer, barometer, IMU, buzzer, and safety switch module.

![ARK RTK GPS](../../assets/hardware/gps/ark_rtk_gps.jpg)

## Where to Buy

Order this module from:

* [ARK Electronics](https://arkelectron.com/product/ark-rtk-gps/) (US)

## Specifications

* [Open Source Schematic and BOM](https://github.com/ARK-Electronics/ARK_RTK_GPS)
* Runs [PX4 Open Source Firmware](https://github.com/PX4/PX4-Autopilot/tree/master/boards/ark/can-rtk-gps)
* Supports [UAVCAN](README.md) [Firmware Updating](node_firmware.md)
* Dynamic [UAVCAN](README.md) node enumeration
* Sensors
* Ublox F9P GPS
* Multi-band GNSS receiver delivers centimeter level accuracy in seconds
* Concurrent reception of GPS, GLONASS, Galileo and BeiDou
* Multi-band RTK with fast convergence times and reliable performance
* High update rate for highly dynamic applications
* Centimeter accuracy in a small and energy efficient module
* Bosch BMM150 Magnetometer
* Bosch BMP388 Barometer
* Invensense ICM-42688-P 6-Axis IMU
* STM32F412CEU6 MCU
* Safety Button
* Buzzer
* Two Pixhawk Standard CAN Connectors
* 4 Pin JST GH
* F9P “UART 2” Connector
* 3 Pin JST GH
* TX, RX, GND
* Pixhawk Standard Debug Connector
* 6 Pin JST SH
* LED Indicators
* Safety LED
* GPS Fix
* RTK Status
* RGB system status
* USA Built
* Power Requirements
* 5V
* 170mA Average
* 180mA Max


### Wiring/Connecting

The ARK RTK GPS is connected to the CAN bus using a Pixhawk standard 4 pin JST GH cable. Multiple sensors can be connected by plugging additional sensors into the ARK RTK GPS's second CAN connector.

General instructions for UAVCAN wiring can also be found in [UAVCAN > Wiring](../uavcan/README.md#wiring).


### Mounting/Orientation

The recommended mounting orientation is with the connectors on the board pointing towards the **back of vehicle**.

The sensor can be mounted anywhere on the frame, but you will need to specify its position, relative to vehicle centre of gravity, during [PX4 configuration](#px4-configuration).


## PX4 Setup

### Enabling UAVCAN

In order to use the ARK RTK GPS board, connect it to the Pixhawk CAN bus and enable the UAVCAN driver by setting parameter [UAVCAN_ENABLE](../advanced_config/parameter_reference.md#UAVCAN_ENABLE) to `2` for dynamic node allocation (or `3` if using [UAVCAN ESCs](../uavcan/escs.md)).

The steps are:
- In *QGroundControl* set the parameter [UAVCAN_ENABLE](../advanced_config/parameter_reference.md#UAVCAN_ENABLE) to `2` or `3` and reboot (see [Finding/Updating Parameters](../advanced_config/parameters.md)).
- Connect ARK GPS CAN to the Pixhawk CAN.

Once enabled, the module will be detected on boot. GPS data should arrive at 10Hz.

General instructions for UAVCAN PX4 configuration can also be found in [UAVCAN > PX4 Configuration](../uavcan/README.md#px4-configuration).

### PX4 Configuration

You need to set necessary [UAVCAN](README.md) parameters and define offsets if the sensor is not centred within the vehicle.
- Enable [UAVCAN_SUB_GPS](../advanced_config/parameter_reference.md#UAVCAN_SUB_GPS), [UAVCAN_SUB_MAG](../advanced_config/parameter_reference.md#UAVCAN_SUB_MAG), and [UAVCAN_SUB_BARO](../advanced_config/parameter_reference.md#UAVCAN_SUB_BARO).
- The parameters [EKF2_GPS_POS_X](../advanced_config/parameter_reference.md#EKF2_GPS_POS_X), [EKF2_GPS_POS_Y](../advanced_config/parameter_reference.md#EKF2_GPS_POS_Y) and [EKF2_GPS_POS_Z](../advanced_config/parameter_reference.md#EKF2_GPS_POS_Z) can be set to account for the offset of the ARK RTK GPS from the vehicles centre of gravity.


## Building ARK RTK GPS Firmware

ARK RTK GPS is sold with a recent firmware build. Developers who want to update to the very latest version can build and install it themselves using the normal PX4 toolchain and sources.

The steps are:

1. Install the [PX4 toolchain](../dev_setup/dev_env.md).
1. Clone the PX4-Autopilot sources, including ARK RTK GPS, using *git*:
```
git clone https://github.com/PX4/PX4-Autopilot --recursive
cd PX4-Autopilot
```
1. Build the ARK RTK GPS firmware:
```
make ark_can-rtk-gps_default
```
1. That will have created a binary in **build/ark_can-rtk-gps_default** named **XX-X.X.XXXXXXXX.uavcan.bin**. Put this binary on the root directory of the flight controller’s SD card to flash the ARK RTK GPS. Next time you power your flight controller with the SD card installed, ARK RTK GPS will automatically be flashed and you should notice the binary is no longer in the root directory and there is now a file named **80.bin** in the *ufw* directory of the SD card.

:::note ARK
RTK GPS will not boot if there is no SD card in the flight controller when powered on.
:::


## Updating ARK RTK GPS Bootloader

ARK RTK GPS comes with the bootloader pre-installed. You can rebuild and reflash it within the PX4-Autopilot environment if desired.

The steps are:

1. Build the ARK RTK GPS bootloader firmware:
```
make ark_can-rtk-gps_canbootloader
```
:::note
This will setup your `launch.json` file if you are in VS code. If using the Black Magic Probe and VS code, make sure to update `BMPGDBSerialPort` within this file to the correct port that your debugger is connected to. On MacOS, the port name should look something like `cu.usbmodemE4CCA0E11`.
:::
1. Connect your ARK RTK GPS to any Serial Wire Debugging (SWD) device that supports use of GNU Project Debugger (GDB), such as the Black Magic Probe, and then connect power to your ARK RTK GPS via one of the CAN ports.
1. Flash the ARK RTK GPS with `ark_can-rtk-gps_canbootloader`. To do so in VS code, you should see `CMake: [ark_can-rtk-gps_canbootloader]: Ready` on the bottom bar of VS code, indicating what you are flashing. You then flash the bootloader by selecting `Start Debugging` in the Run and Debug window of VS code.
3. With the bootloader flashed, you are ready to build and flash the ARK RTK GPS firmware `ark_can-rtk-gps_default` as outlined above.


## LED Meanings

You will see green, blue and red LEDs on the ARK RTK GPS when it is being flashed, and a blinking green LED if it is running properly.

If you see a red LED there is an error and you should check the following:
- Make sure the flight controller has an SD card installed.
- Make sure the ARK RTK GPS has `ark_can-rtk-gps_canbootloader` installed prior to flashing `ark_can-rtk-gps_default`.
- Remove binaries from the root and ufw directories of the SD card and try to build and flash again.
1 change: 1 addition & 0 deletions ja/SUMMARY.md
Original file line number Diff line number Diff line change
Expand Up @@ -214,6 +214,7 @@
* [ARK GPS](uavcan/ark_gps.md)
* [Hex Here2](gps_compass/gps_hex_here2.md)
* [RTK GPS](gps_compass/rtk_gps.md)
* [ARK RTK GPS](uavcan/ark_rtk_gps.md)
* [RTK GPS Heading with Dual u-blox F9P](gps_compass/u-blox_f9p_heading.md)
* [CUAV C-RTK](gps_compass/rtk_gps_cuav_c-rtk.md)
* [Drotek XL](gps_compass/rtk_gps_drotek_xl.md)
Expand Down
2 changes: 1 addition & 1 deletion ja/getting_started/px4_basic_concepts.md
Original file line number Diff line number Diff line change
Expand Up @@ -233,7 +233,7 @@ All the vehicles, boats and aircraft have a heading direction or an orientation
![Frame Heading](../../assets/concepts/frame_heading.png)

:::note
For a VTOL Tailsitter the heading is relative to the multirotor configuration (i.e. vehicle pose during, takeoff, hovering, landing).
For a VTOL Tailsitter the heading is relative to the multirotor configuration (i.e. vehicle pose during takeoff, hovering, landing).
:::

It is important to know the vehicle heading direction in order to align the autopilot with the vehicle vector of movement. Multicopters have a heading even when they are symmetrical from all sides! Usually manufacturers use a colored props or colored arms to indicate the heading.
Expand Down
3 changes: 2 additions & 1 deletion ja/gps_compass/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -19,6 +19,7 @@ PX4 should work with any unit that communicates via the u-blox, MTK Ashtech or E
| Device | GPS | Compass | [RTK](../gps_compass/rtk_gps.md) | [GPS Yaw Output](#configuring-gps-as-yaw-heading-source) | [Dual F9P GPS Heading](../gps_compass/u-blox_f9p_heading.md) |
|:------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------------- |:------------:|:----------------:|:--------------------------------:|:--------------------------------------------------------:|:------------------------------------------------------------:|
| [ARK GPS](https://arkelectron.com/product/ark-gps/) | M9N | ICM42688p | | | |
| [ARK RTK GPS](https://arkelectron.com/product/ark-rtk-gps/) | F9P | ICM42688p | ✓ | | ✓ |
| [Avionics Anonymous UAVCAN GNSS/Mag](https://www.tindie.com/products/avionicsanonymous/uavcan-gps-magnetometer/) | SAM-M8Q | MMC5983MA | | | |
| [Avionics Anonymous UAVCAN Magnetometer](https://www.tindie.com/products/avionicsanonymous/uavcan-magnetometer/) | ✗ | ✓ | | | |
| [CUAV C-RTK GPS](../gps_compass/rtk_gps_cuav_c-rtk.md) | M8P/M8N | ✓ | ✓ | | |
Expand Down Expand Up @@ -59,7 +60,7 @@ Instructions for connecting the GPS (and compass, if present) are usually provid

[Pixhawk Series](../flight_controller/pixhawk_series.md) controllers typically have a clearly labeled port for connecting the GPS, and the compass is connected to either the I2C or SPI port/bus (depending on the device).

The [Zubax GNSS 2](https://zubax.com/products/gnss_2), [CubePilot Here3 CAN GNSS GPS (M8N)](https://www.cubepilot.org/#/here/here3), and [Avionics Anonymous GNSS/Mag](https://www.tindie.com/products/avionicsanonymous/uavcan-gps-magnetometer/) can also be connected via [UAVCAN](../uavcan/README.md).
The [ARK GPS](../uavcan/ark_gps.md), [ARK RTK GPS](../uavcan/ark_rtk_gps.md), [Zubax GNSS 2](https://zubax.com/products/gnss_2), [CubePilot Here3 CAN GNSS GPS (M8N)](https://www.cubepilot.org/#/here/here3), and [Avionics Anonymous GNSS/Mag](https://www.tindie.com/products/avionicsanonymous/uavcan-gps-magnetometer/) can also be connected via [UAVCAN](../uavcan/README.md).

:::warning
Pay attention to pinout when connecting the GPS module. While these are all software-compatible, there are several different pin orderings.
Expand Down
Loading

0 comments on commit 99d1121

Please sign in to comment.