#include <mavlink_msg_control_system_state.h>
Public Attributes | |
float | airspeed |
float | pitch_rate |
float | pos_variance [3] |
float | q [4] |
float | roll_rate |
uint64_t | time_usec |
float | vel_variance [3] |
float | x_acc |
float | x_pos |
float | x_vel |
float | y_acc |
float | y_pos |
float | y_vel |
float | yaw_rate |
float | z_acc |
float | z_pos |
float | z_vel |
Definition at line 5 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::airspeed |
Definition at line 17 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::pitch_rate |
Definition at line 22 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::pos_variance[3] |
Definition at line 19 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::q[4] |
Definition at line 20 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::roll_rate |
Definition at line 21 of file mavlink_msg_control_system_state.h.
uint64_t __mavlink_control_system_state_t::time_usec |
Definition at line 7 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::vel_variance[3] |
Definition at line 18 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::x_acc |
Definition at line 8 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::x_pos |
Definition at line 14 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::x_vel |
Definition at line 11 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::y_acc |
Definition at line 9 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::y_pos |
Definition at line 15 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::y_vel |
Definition at line 12 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::yaw_rate |
Definition at line 23 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::z_acc |
Definition at line 10 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::z_pos |
Definition at line 16 of file mavlink_msg_control_system_state.h.
float __mavlink_control_system_state_t::z_vel |
Definition at line 13 of file mavlink_msg_control_system_state.h.