
Public Member Functions | |
| std::string const | get_name () const |
| Plugin name (CamelCase) | |
| const message_map | get_rx_handlers () |
| Return map with message rx handlers. | |
| void | initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
| Plugin initializer. | |
| SystemTimePlugin () | |
Private Member Functions | |
| void | handle_system_time (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
| void | sys_time_cb (const ros::TimerEvent &event) |
Private Attributes | |
| TimeSyncStatus | dt_diag |
| std::string | frame_id |
| ros::Timer | sys_time_timer |
| ros::Publisher | time_offset_pub |
| uint64_t | time_offset_us |
| ros::Publisher | time_ref_pub |
| std::string | time_ref_source |
| UAS * | uas |
Definition at line 135 of file sys_time.cpp.