Camera IMU synchronisation plugin. More...
Public Member Functions | |
CamIMUSyncPlugin () | |
Subscriptions | get_subscriptions () |
void | initialize (UAS &uas_) |
Public Member Functions inherited from mavros::plugin::PluginBase | |
virtual | ~PluginBase () |
Private Member Functions | |
void | handle_cam_trig (const mavlink::mavlink_message_t *msg, mavlink::common::msg::CAMERA_TRIGGER &ctrig) |
Private Attributes | |
ros::Publisher | cam_imu_pub |
ros::NodeHandle | cam_imu_sync_nh |
Additional Inherited Members | |
Public Types inherited from mavros::plugin::PluginBase | |
typedef boost::shared_ptr< PluginBase const > | ConstPtr |
typedef mavconn::MAVConnInterface::ReceivedCb | HandlerCb |
typedef std::tuple< mavlink::msgid_t, const char *, size_t, HandlerCb > | HandlerInfo |
typedef boost::shared_ptr< PluginBase > | Ptr |
typedef std::vector< HandlerInfo > | Subscriptions |
Protected Member Functions inherited from mavros::plugin::PluginBase | |
virtual void | connection_cb (bool connected) |
void | enable_connection_cb () |
HandlerInfo | make_handler (void(_C::*fn)(const mavlink::mavlink_message_t *, _T &)) |
HandlerInfo | make_handler (const mavlink::msgid_t id, void(_C::*fn)(const mavlink::mavlink_message_t *msg, const mavconn::Framing framing)) |
PluginBase () | |
Protected Attributes inherited from mavros::plugin::PluginBase | |
UAS * | m_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.