ActuatorControl plugin. More...

| Public Member Functions | |
| ActuatorControlPlugin () | |
| const message_map | get_rx_handlers () | 
| Return map with message rx handlers. | |
| void | initialize (UAS &uas_) | 
| Plugin initializer. | |
| Private Member Functions | |
| void | actuator_control_cb (const mavros_msgs::ActuatorControl::ConstPtr &req) | 
| void | set_actuator_control_target (const uint64_t time_usec, const uint8_t group_mix, const float controls[8]) | 
| message definiton here: http://mavlink.org/messages/common#SET_ACTUATOR_CONTROL_TARGET | |
| Private Attributes | |
| ros::Subscriber | actuator_control_sub | 
| ros::NodeHandle | nh | 
| UAS * | uas | 
ActuatorControl plugin.
Sends actuator controls to FCU controller.
Definition at line 28 of file actuator_control.cpp.