MocapPoseEstimate plugin. More...
Public Member Functions | |
const message_map | get_rx_handlers () |
void | initialize (UAS &uas_) |
MocapPoseEstimatePlugin () | |
Private Member Functions | |
void | mocap_pose_cb (const geometry_msgs::PoseStamped::ConstPtr &pose) |
void | mocap_pose_send (uint64_t usec, float q[4], float x, float y, float z) |
void | mocap_tf_cb (const geometry_msgs::TransformStamped::ConstPtr &trans) |
Private Attributes | |
ros::Subscriber | mocap_pose_sub |
ros::Subscriber | mocap_tf_sub |
ros::NodeHandle | mp_nh |
UAS * | uas |
MocapPoseEstimate plugin.
Sends motion capture data to FCU.
Definition at line 32 of file mocap_pose_estimate.cpp.