Vision speed estimate plugin. More...
Public Member Functions | |
const message_map | get_rx_handlers () |
void | initialize (UAS &uas_) |
VisionSpeedEstimatePlugin () | |
Private Member Functions | |
void | send_vision_speed (const geometry_msgs::Vector3 &vel_enu, const ros::Time &stamp) |
Send vision speed estimate to FCU velocity controller. | |
void | vel_speed_cb (const geometry_msgs::Vector3Stamped::ConstPtr &req) |
void | vel_twist_cb (const geometry_msgs::TwistStamped::ConstPtr &req) |
void | vision_speed_estimate (uint64_t usec, float x, float y, float z) |
Private Attributes | |
ros::NodeHandle | sp_nh |
UAS * | uas |
ros::Subscriber | vision_vel_sub |
Vision speed estimate plugin.
Send velocity estimation from various vision estimators to FCU position and attitude estimators.
Definition at line 33 of file vision_speed_estimate.cpp.