PX4 Optical Flow plugin. More...

Public Member Functions | |
| const message_map | get_rx_handlers () |
| void | initialize (UAS &uas_) |
| PX4FlowPlugin () | |
Private Member Functions | |
| void | handle_optical_flow_rad (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
Private Attributes | |
| ros::NodeHandle | flow_nh |
| ros::Publisher | flow_rad_pub |
| std::string | frame_id |
| ros::Publisher | range_pub |
| double | ranger_fov |
| double | ranger_max_range |
| double | ranger_min_range |
| ros::Publisher | temp_pub |
| UAS * | uas |
PX4 Optical Flow plugin.
This plugin can publish data from PX4Flow camera to ROS
Definition at line 31 of file px4flow.cpp.