Public Member Functions | Private Member Functions | Private Attributes | Friends
mavplugin::SetpointVelocityPlugin Class Reference

Setpoint velocity plugin. More...

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

List of all members.

Public Member Functions

const std::string get_name () const
 Plugin name (CamelCase)
const message_map get_rx_handlers ()
 Return map with message rx handlers.
void initialize (UAS &uas_, ros::NodeHandle &nh, diagnostic_updater::Updater &diag_updater)
 Plugin initializer.
 SetpointVelocityPlugin ()

Private Member Functions

void send_setpoint_velocity (const ros::Time &stamp, float vx, float vy, float vz, float yaw_rate)
void vel_cb (const geometry_msgs::TwistStamped::ConstPtr &req)

Private Attributes

ros::NodeHandle sp_nh
UASuas
ros::Subscriber vel_sub

Friends

class SetPositionTargetLocalNEDMixin

Detailed Description

Setpoint velocity plugin.

Send setpoint velocities to FCU controller.

Definition at line 41 of file setpoint_velocity.cpp.


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


mavros
Author(s): Vladimir Ermakov
autogenerated on Wed Aug 26 2015 12:29:13