Setpoint velocity plugin. More...
Public Member Functions | |
const message_map | get_rx_handlers () |
Return map with message rx handlers. | |
void | initialize (UAS &uas_) |
Plugin initializer. | |
SetpointVelocityPlugin () | |
Private Member Functions | |
void | send_setpoint_velocity (const ros::Time &stamp, Eigen::Vector3d &vel_enu, double yaw_rate) |
Send velocity to FCU velocity controller. | |
void | vel_cb (const geometry_msgs::TwistStamped::ConstPtr &req) |
Private Attributes | |
ros::NodeHandle | sp_nh |
UAS * | uas |
ros::Subscriber | vel_sub |
Friends | |
class | SetPositionTargetLocalNEDMixin |
Setpoint velocity plugin.
Send setpoint velocities to FCU controller.
Definition at line 31 of file setpoint_velocity.cpp.