System time plugin. More...

| Public Member Functions | |
| const message_map | get_rx_handlers () | 
| Return map with message rx handlers. | |
| void | initialize (UAS &uas_) | 
| Plugin initializer. | |
| SystemTimePlugin () | |
| Private Member Functions | |
| void | average_offset (int64_t offset_ns) | 
| void | handle_system_time (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) | 
| void | handle_timesync (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) | 
| void | send_timesync_msg (uint64_t tc1, uint64_t ts1) | 
| void | sys_time_cb (const ros::TimerEvent &event) | 
| void | timesync_cb (const ros::TimerEvent &event) | 
| Private Attributes | |
| TimeSyncStatus | dt_diag | 
| ros::NodeHandle | nh | 
| double | offset_avg_alpha | 
| ros::Timer | sys_time_timer | 
| int64_t | time_offset_ns | 
| ros::Publisher | time_ref_pub | 
| std::string | time_ref_source | 
| ros::Timer | timesync_timer | 
| UAS * | uas | 
System time plugin.
Definition at line 129 of file sys_time.cpp.