Public Member Functions | Private Member Functions | Private Attributes
mavplugin::VisionSpeedEstimatePlugin Class Reference

Vision speed estimate plugin. More...

Inheritance diagram for mavplugin::VisionSpeedEstimatePlugin:
Inheritance graph
[legend]

List of all members.

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)
 VisionSpeedEstimatePlugin ()

Private Member Functions

void send_vision_speed (float vx, float vy, float vz, const ros::Time &stamp)
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
UASuas
ros::Subscriber vision_vel_sub

Detailed Description

Vision speed estimate plugin.

Send speed estimation from various vision estimators to FCU position controller.

Definition at line 43 of file vision_speed_estimate.cpp.


The documentation for this class was generated from the following file:


mavros_extras
Author(s): Vladimir Ermakov
autogenerated on Wed Aug 26 2015 12:29:20