Local position plugin. Publish local position to TF, PositionStamped, TwistStamped and Odometry. More...
Public Member Functions | |
const message_map | get_rx_handlers () |
Return map with message rx handlers. | |
void | initialize (UAS &uas_) |
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 | frame_id |
frame for Pose | |
ros::Publisher | local_odom |
ros::Publisher | local_position |
ros::Publisher | local_velocity |
ros::NodeHandle | lp_nh |
std::string | tf_child_frame_id |
frame for TF | |
std::string | tf_frame_id |
origin for TF | |
bool | tf_send |
bool | tf_send_fcu |
report NED->aircraft in tf tree | |
UAS * | uas |
Local position plugin. Publish local position to TF, PositionStamped, TwistStamped and Odometry.
Definition at line 35 of file local_position.cpp.