#include <mavlink_msg_hil_gps.h>
Public Attributes | |
int32_t | alt |
uint16_t | cog |
uint16_t | eph |
uint16_t | epv |
uint8_t | fix_type |
int32_t | lat |
int32_t | lon |
uint8_t | satellites_visible |
uint64_t | time_usec |
int16_t | vd |
int16_t | ve |
uint16_t | vel |
int16_t | vn |
Definition at line 5 of file mavlink_msg_hil_gps.h.
int32_t __mavlink_hil_gps_t::alt |
Definition at line 10 of file mavlink_msg_hil_gps.h.
uint16_t __mavlink_hil_gps_t::cog |
Definition at line 17 of file mavlink_msg_hil_gps.h.
uint16_t __mavlink_hil_gps_t::eph |
Definition at line 11 of file mavlink_msg_hil_gps.h.
uint16_t __mavlink_hil_gps_t::epv |
Definition at line 12 of file mavlink_msg_hil_gps.h.
uint8_t __mavlink_hil_gps_t::fix_type |
Definition at line 18 of file mavlink_msg_hil_gps.h.
int32_t __mavlink_hil_gps_t::lat |
Definition at line 8 of file mavlink_msg_hil_gps.h.
int32_t __mavlink_hil_gps_t::lon |
Definition at line 9 of file mavlink_msg_hil_gps.h.
uint8_t __mavlink_hil_gps_t::satellites_visible |
Definition at line 19 of file mavlink_msg_hil_gps.h.
uint64_t __mavlink_hil_gps_t::time_usec |
Definition at line 7 of file mavlink_msg_hil_gps.h.
int16_t __mavlink_hil_gps_t::vd |
Definition at line 16 of file mavlink_msg_hil_gps.h.
int16_t __mavlink_hil_gps_t::ve |
Definition at line 15 of file mavlink_msg_hil_gps.h.
uint16_t __mavlink_hil_gps_t::vel |
Definition at line 13 of file mavlink_msg_hil_gps.h.
int16_t __mavlink_hil_gps_t::vn |
Definition at line 14 of file mavlink_msg_hil_gps.h.