#include <mixer_direct.hpp>

Public Member Functions | |
| DirectMixer (const ros::NodeHandle &nh) | |
| ~DirectMixer () final=default | |
Public Member Functions inherited from BaseReverseMixer | |
| BaseReverseMixer (const ros::NodeHandle &nh) | |
| virtual int8_t | init () |
| virtual | ~BaseReverseMixer ()=default |
Protected Member Functions | |
| void | motorsCallback (sensor_msgs::Joy msg) override |
Static Protected Attributes | |
| static constexpr uint8_t | MAX_CHANNELS = 8 |
Additional Inherited Members | |
Public Attributes inherited from BaseReverseMixer | |
| ros::NodeHandle | _node |
| ros::Publisher | actuatorsPub |
| ros::Subscriber | motorsSub |
| sensor_msgs::Joy | sp_to_dynamics |
Static Public Attributes inherited from BaseReverseMixer | |
| static constexpr char | MAPPED_ACTUATOR_TOPIC [] = "/uav/actuators" |
| static constexpr char | MOTORS_TOPIC [] = "/uav/actuators_raw" |
| static constexpr char | SERVOS_TOPIC [] = "/uav/servo" |
Definition at line 24 of file mixer_direct.hpp.
|
inlineexplicit |
Definition at line 26 of file mixer_direct.hpp.
|
finaldefault |
|
overrideprotectedvirtual |
Implements BaseReverseMixer.
Definition at line 21 of file mixer_direct.cpp.
|
inlinestaticconstexprprotected |
Definition at line 34 of file mixer_direct.hpp.