PX4 Optical Flow plugin. More...
Public Member Functions | |
const std::string | get_name () const |
const message_map | get_rx_handlers () |
void | initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
PX4FlowPlugin () | |
Private Member Functions | |
void | handle_optical_flow (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
void | optical_flow (uint64_t time_usec, uint8_t sensor_id, uint16_t flow_x, uint16_t flow_y, float flow_comp_m_x, float flow_comp_m_y, uint8_t quality, float ground_distance) |
void | send_flow_cb (const mavros_extras::OpticalFlow::ConstPtr flow_msg) |
Private Attributes | |
ros::Publisher | flow_pub |
ros::Subscriber | flow_sub |
UAS * | uas |
PX4 Optical Flow plugin.
This plugin can publish data from PX4Flow camera to ROS and send it to FCU.
Definition at line 41 of file px4flow.cpp.