오프보드 제어
WARNING
Offboard control is dangerous. 오프보드 비행전에 적절한 준비, 테스트 및 안전 예방 조치를 취하여야 합니다.
오프보드 제어의 아이디어는 자동조종장치 외부에서 실행되는 소프트웨어를 사용하여 PX4를 제어하는 것입니다. This is done through the MAVLink protocol, specifically the SET_POSITION_TARGET_LOCAL_NED and the SET_ATTITUDE_TARGET messages.
오프보드 제어 펌웨어 설정
오프보드 개발전에 펌웨어에서 두 가지를 설정하여야 합니다.
Enable RC Override
In QGroundControl you can set the COM_RC_OVERRIDE parameter to automatically switch from offboard mode (or any mode) to Position mode if the RC sticks are moved. This is the best way to ensure that an operator can easily take control of the vehicle and switch to the safest flight mode.
RC 스위치를 오프보드 모드 활성화에 매핑
In QGroundControl you can set the RC_MAP_OFFB_SW parameter to the RC channel that will be used to activate offboard mode. This can be used to switch between offboard mode and the mode set by the mode switch (RC_MAP_MODE_SW). You can also switch into offboard mode using a GCS/MAVLink so this is not "mandatory".
Note also that this mechanism is not as "safe" as using RC Override to switch out of offboard mode, because the mode you switch to is unpredictable.
보조 컴퓨터 인터페이스 활성화
Enable MAVLink on the serial port that you connect to the companion computer (see Companion Computers).
하드웨어 설정
일반적으로 오프보드 통신을 설정하는 방법에는 세 가지가 있습니다.
직렬 라디오
하나는 자동조종장치의 UART 포트에 연결합니다.
One connected to a ground station computer
Example radios include:
온보드 프로세서
A small computer mounted onto the vehicle, connected to the autopilot through a serial port or Ehthernet port. There are many possibilities here and it will depend on what kind of additional on-board processing you want to do in addition to sending commands to the autopilot. Some examples are provided in Companion Computers.
On-board processor and wifi link to ROS (Recommended)
A small computer mounted onto the vehicle connected to the autopilot through a UART to USB adapter while also having a WiFi link to a ground station running ROS. This can be any of the computers from the above section coupled with a WiFi adapter.