Vision pose estimate plugin. More...

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) |
| VisionPoseEstimatePlugin () | |
Private Member Functions | |
| void | send_vision_transform (const tf::Transform &transform, const ros::Time &stamp) |
| void | vision_cb (const geometry_msgs::PoseStamped::ConstPtr &req) |
| void | vision_cov_cb (const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &req) |
| void | vision_position_estimate (uint64_t usec, float x, float y, float z, float roll, float pitch, float yaw) |
Private Attributes | |
| std::string | child_frame_id |
| std::string | frame_id |
| ros::Time | last_transform_stamp |
| ros::NodeHandle | sp_nh |
| double | tf_rate |
| UAS * | uas |
| ros::Subscriber | vision_sub |
Friends | |
| class | TFListenerMixin |
Vision pose estimate plugin.
Send pose estimation from various vision estimators to FCU position controller.
Definition at line 44 of file vision_pose_estimate.cpp.