Setpoint acceleration/force plugin. More...
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. | |
SetpointAccelerationPlugin () | |
Private Member Functions | |
void | accel_cb (const geometry_msgs::Vector3Stamped::ConstPtr &req) |
void | send_setpoint_acceleration (const ros::Time &stamp, float afx, float afy, float afz) |
Private Attributes | |
ros::Subscriber | accel_sub |
bool | send_force |
ros::NodeHandle | sp_nh |
UAS * | uas |
Friends | |
class | SetPositionTargetLocalNEDMixin |
Setpoint acceleration/force plugin.
Send setpoint accelerations/forces to FCU controller.
Definition at line 42 of file setpoint_accel.cpp.