mavros_msgs/VehicleInfo Message

File: mavros_msgs/VehicleInfo.msg

Raw Message Definition

# Vehicle Info msg

std_msgs/Header header

uint8 HAVE_INFO_HEARTBEAT = 1
uint8 HAVE_INFO_AUTOPILOT_VERSION = 2
uint8 available_info # Bitmap shows what info is available

# Vehicle address
uint8 sysid                     # SYSTEM ID
uint8 compid                    # COMPONENT ID

# -*- Heartbeat info -*-
uint8 autopilot                 # MAV_AUTOPILOT
uint8 type                      # MAV_TYPE
uint8 system_status             # MAV_STATE
uint8 base_mode
uint32 custom_mode
string mode                     # MAV_MODE string
uint32 mode_id                  # MAV_MODE number

# -*- Autopilot version -*-
uint64 capabilities             # MAV_PROTOCOL_CAPABILITY
uint32 flight_sw_version        # Firmware version number
uint32 middleware_sw_version    # Middleware version number
uint32 os_sw_version            # Operating system version number
uint32 board_version            # HW / board version (last 8 bytes should be silicon ID, if any)
string flight_custom_version    # Custom version field, commonly from the first 8 bytes of the git hash
uint16 vendor_id                # ID of the board vendor
uint16 product_id               # ID of the product
uint64 uid                      # UID if provided by hardware

Compact Message Definition

uint8 HAVE_INFO_HEARTBEAT=1
uint8 HAVE_INFO_AUTOPILOT_VERSION=2
std_msgs/Header header
uint8 available_info
uint8 sysid
uint8 compid
uint8 autopilot
uint8 type
uint8 system_status
uint8 base_mode
uint32 custom_mode
string mode
uint32 mode_id
uint64 capabilities
uint32 flight_sw_version
uint32 middleware_sw_version
uint32 os_sw_version
uint32 board_version
string flight_custom_version
uint16 vendor_id
uint16 product_id
uint64 uid