Vision pose estimate plugin. More...
Public Member Functions | |
const message_map | get_rx_handlers () |
void | initialize (UAS &uas_) |
VisionPoseEstimatePlugin () | |
Private Member Functions | |
void | send_vision_estimate (const ros::Time &stamp, const Eigen::Affine3d &tr) |
Send vision estimate transform to FCU position controller. | |
void | transform_cb (const geometry_msgs::TransformStamped &transform) |
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 | |
ros::Time | last_transform_stamp |
ros::NodeHandle | sp_nh |
std::string | tf_child_frame_id |
std::string | tf_frame_id |
double | tf_rate |
UAS * | uas |
ros::Subscriber | vision_cov_sub |
ros::Subscriber | vision_sub |
Friends | |
class | TF2ListenerMixin |
Vision pose estimate plugin.
Send pose estimation from various vision estimators to FCU position and attitude estimators.
Definition at line 34 of file vision_pose_estimate.cpp.