Camera IMU synchronisation plugin. More...
Public Member Functions | |
CamIMUSyncPlugin () | |
const message_map | get_rx_handlers () |
void | initialize (UAS &uas_) |
Private Member Functions | |
void | handle_cam_trig (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
Private Attributes | |
ros::Publisher | cam_imu_pub |
ros::NodeHandle | cam_imu_sync_nh |
UAS * | uas |
Camera IMU synchronisation plugin.
This plugin publishes a timestamp for when a external camera system was triggered by the FCU. Sequence ID from the message and the image sequence from camera can be corellated to get the exact shutter trigger time.
Definition at line 30 of file cam_imu_sync.cpp.