#include <mavlink_msg_scaled_imu3.h>
Public Attributes | |
uint32_t | time_boot_ms |
int16_t | xacc |
int16_t | xgyro |
int16_t | xmag |
int16_t | yacc |
int16_t | ygyro |
int16_t | ymag |
int16_t | zacc |
int16_t | zgyro |
int16_t | zmag |
Definition at line 5 of file mavlink_msg_scaled_imu3.h.
uint32_t __mavlink_scaled_imu3_t::time_boot_ms |
Definition at line 7 of file mavlink_msg_scaled_imu3.h.
int16_t __mavlink_scaled_imu3_t::xacc |
Definition at line 8 of file mavlink_msg_scaled_imu3.h.
int16_t __mavlink_scaled_imu3_t::xgyro |
Definition at line 11 of file mavlink_msg_scaled_imu3.h.
int16_t __mavlink_scaled_imu3_t::xmag |
Definition at line 14 of file mavlink_msg_scaled_imu3.h.
int16_t __mavlink_scaled_imu3_t::yacc |
Definition at line 9 of file mavlink_msg_scaled_imu3.h.
int16_t __mavlink_scaled_imu3_t::ygyro |
Definition at line 12 of file mavlink_msg_scaled_imu3.h.
int16_t __mavlink_scaled_imu3_t::ymag |
Definition at line 15 of file mavlink_msg_scaled_imu3.h.
int16_t __mavlink_scaled_imu3_t::zacc |
Definition at line 10 of file mavlink_msg_scaled_imu3.h.
int16_t __mavlink_scaled_imu3_t::zgyro |
Definition at line 13 of file mavlink_msg_scaled_imu3.h.
int16_t __mavlink_scaled_imu3_t::zmag |
Definition at line 16 of file mavlink_msg_scaled_imu3.h.