Local position plugin. Publish local position to TF and PositionStamped, send local position and visual position estimates to FCU. More...

Public Member Functions | |
| std::string const | get_name () const |
| Plugin name (CamelCase) | |
| const message_map | get_rx_handlers () |
| Return map with message rx handlers. | |
| void | initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater) |
| Plugin initializer. | |
| LocalPositionPlugin () | |
Private Member Functions | |
| void | handle_local_position_ned (const mavlink_message_t *msg, uint8_t sysid, uint8_t compid) |
Private Attributes | |
| std::string | child_frame_id |
| frame for TF and Pose | |
| std::string | frame_id |
| origin for TF | |
| ros::Publisher | local_position |
| ros::NodeHandle | pos_nh |
| bool | send_tf |
| tf::TransformBroadcaster | tf_broadcaster |
| UAS * | uas |
Local position plugin. Publish local position to TF and PositionStamped, send local position and visual position estimates to FCU.
Definition at line 41 of file local_position.cpp.