GPS plugin. More...
Public Member Functions | |
std::string const | get_name () const |
Plugin name (CamelCase) | |
const message_map | get_rx_handlers () |
Return map with message rx handlers. | |
GPSPlugin () | |
void | initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
Plugin initializer. | |
Private Member Functions | |
void | handle_gps_raw_int (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
void | handle_gps_status (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
Private Attributes | |
ros::Publisher | fix_pub |
std::string | frame_id |
GPSInfo | gps_diag |
ros::Publisher | time_ref_pub |
std::string | time_ref_source |
UAS * | uas |
ros::Publisher | vel_pub |
GPS plugin.
This plugin implements same ROS topics as nmea_navsat_driver package.