
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) |
| MocapPoseEstimatePlugin () | |
Private Member Functions | |
| void | mocap_pose_cb (const geometry_msgs::Pose::ConstPtr &pose) |
| void | mocap_pose_send (uint64_t usec, float x, float y, float z, float roll, float pitch, float yaw) |
| 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 |
Definition at line 37 of file mocap_pose_estimate.cpp.