bebop_msgs/CommonCalibrationStateMagnetoCalibrationAxisToCalibrateChanged Message

File: bebop_msgs/CommonCalibrationStateMagnetoCalibrationAxisToCalibrateChanged.msg

Raw Message Definition

# CommonCalibrationStateMagnetoCalibrationAxisToCalibrateChanged
# auto-generated from up stream XML files at
#   github.com/Parrot-Developers/libARCommands/tree/master/Xml
# To check upstream commit hash, refer to last_build_info file
# Do not modify this file by hand. Check scripts/meta folder for generator files.
#
# SDK Comment: Axis to calibrate during calibration process.

Header header

# The axis to calibrate
uint8 axis_xAxis=0  # If the current calibration axis should be the x axis
uint8 axis_yAxis=1  # If the current calibration axis should be the y axis
uint8 axis_zAxis=2  # If the current calibration axis should be the z axis
uint8 axis_none=3  # If none of the axis should be calibrated
uint8 axis

Compact Message Definition

uint8 axis_xAxis=0
uint8 axis_yAxis=1
uint8 axis_zAxis=2
uint8 axis_none=3
std_msgs/Header header
uint8 axis