• Home
    • Copter
    • Plane
    • Rover
    • Blimp
    • Sub
    • AntennaTracker
    • Mission Planner
    • APM Planner 2
    • MAVProxy
    • Companion Computers
    • Developer
  • Downloads
    • Mission Planner
    • APM Planner 2
    • Advanced User Tools
    • Developer Tools
    • Firmware
  • Community
    • Support Forums
    • Facebook
    • Developer Chat (Discord)
    • Developer Voice (Discord)
    • Contact us
    • Getting involved
    • Commercial Support
    • Development Team
    • UAS Training Centers
  • Stores
  • About
    • History
    • License
    • Trademark
    • Acknowledgments
    • Wiki Editing Guide
    • Partners Program
Dev Logo
  • License (GPLv3)
  • AP_Peripheral Devices
  • Downloading the code / Using Git
  • Building the code
  • Editors & IDEs
  • Learning the code
  • Simulation & Testing
  • Debugging
  • ArduPilot On Linux
  • Support Proxy
  • Contributing Code
  • MAVLink Interface
    • MAVLink Basics
    • Request Data From The AutoPilot
    • Get and Set Parameters
    • Copter Commands (Guided Mode)
    • Plane Commands (Guided Mode)
    • Rover Commands (Guided Mode)
    • Get and Set Home and/or EKF origin
    • Arm and Disarm
    • Get and Set FlightMode
    • Camera Commands
    • Gimbal / Camera Mount
    • MAVFTP
    • Mission Upload/Download
    • Move a Servo
    • Non-GPS Position Estimation
    • Precision Landing
    • RC Input (aka Pilot Input)
    • Winch Commands
    • MAVLink Routing
    • Other Commands
    • Mission Command List
    • Mission Command Package Format
  • CAN and DroneCAN/UAVCAN
  • Companion Computers
  • ROS1/ROS2
  • Lua Scripts
  • Porting to a new Flight Controller
  • OEM Customization
  • Secure Firmware
  • RemoteID
  • Advanced Hardware Info
  • MAVProxy Developer GCS
  • Resources for GCS Developers
  • RTF Vehicle Developer Information
  • How The Team Works
  • Events
  • Training Centers
  • GSoC
  • Developers Conference
  • 2022 Roadmap
  • Wiki Editing Guide
  • USB IDs
  • User Alerts
  • Academic Works Involving ArduPilot
  • Appendix


Individual Partners SWAG Shop
Dev
  • MAVLink Interface
  • MAVLink Interface’s Other Commands
  • Edit on GitHub

MAVLink Interface’s Other Commands¶

This article lists other commonly used MAVLink commands that do not directly affect how a vehicle moves and that are not covered by other pages.

MAV_CMDs¶

These MAV_CMDs should be packaged within a COMMAND_LONG message.

  • MAV_CMD_DO_AUTOTUNE_ENABLE (Plane only)

  • MAV_CMD_DO_DIGICAM_CONFIGURE

  • MAV_CMD_DO_DIGICAM_CONTROL

  • MAV_CMD_DO_FENCE_ENABLE

  • MAV_CMD_DO_GO_AROUND (Plane only)

  • MAV_CMD_DO_LAND_START (Plane only)

  • MAV_CMD_DO_GRIPPER

  • MAV_CMD_DO_MOTOR_TEST

  • MAV_CMD_DO_PARACHUTE

  • MAV_CMD_PREFLIGHT_REBOOT_SHUTDOWN

  • MAV_CMD_DO_REPEAT_SERVO

  • MAV_CMD_DO_REPEAT_RELAY

  • MAV_CMD_DO_SEND_BANNER

  • MAV_CMD_DO_SET_RELAY

  • MAV_CMD_DO_SET_SERVO

  • MAV_CMD_DO_MOUNT_CONFIGURE

  • MAV_CMD_DO_MOUNT_CONTROL

  • MAV_CMD_MISSION_START

  • MAV_CMD_PREFLIGHT_CALIBRATION

  • MAV_CMD_PREFLIGHT_SET_SENSOR_OFFSETS

  • MAV_CMD_PREFLIGHT_REBOOT_SHUTDOWN

  • MAV_CMD_REQUEST_AUTOPILOT_CAPABILITIES

  • MAV_CMD_START_RX_PAIR - starts receiver pairing

  • MAV_CMD_DO_START_MAG_CAL

  • MAV_CMD_DO_ACCEPT_MAG_CAL

  • MAV_CMD_DO_CANCEL_MAG_CAL

Other commands¶

Below are other commands that will be handled by Copter

  • ADSB_VEHICLE

  • AUTOPILOT_VERSION_REQUEST

  • COMMAND_ACK

  • FENCE_POINT

  • FENCE_FETCH_POINT

  • GIMBAL_REPORT

  • GPS_INJECT_DATA

  • HEARTBEAT

  • HIL_STATE

  • LANDING_TARGET

  • LED_CONTROL

  • LOG_ERASE

  • LOG_REQUEST_DATA

  • LOG_REQUEST_END

  • LOG_REQUEST_LIST

  • RADIO

  • RADIO_STATUS

  • RALLY_FETCH_POINT

  • RALLY_POINT

  • RC_CHANNELS_OVERRIDE

  • REQUEST_DATA_STREAM

  • REMOTE_LOG_BLOCK_STATUS

  • SERIAL_CONTROL

  • TERRAIN_DATA

  • TERRAIN_CHECK

Previous Next

Questions, issues, and suggestions about this page can be raised on the forums. Issues and suggestions may be posted on the forums or the Github Issue Tracker.

Creative Commons License© Copyright 2024, ArduPilot Dev Team.