Public Member Functions | Public Attributes | Static Public Attributes | List of all members
BaseReverseMixer Class Referenceabstract

#include <base_mixer.hpp>

Inheritance diagram for BaseReverseMixer:
Inheritance graph
[legend]

Public Member Functions

 BaseReverseMixer (const ros::NodeHandle &nh)
 
virtual int8_t init ()
 
virtual void motorsCallback (sensor_msgs::Joy msg)=0
 
virtual ~BaseReverseMixer ()=default
 

Public Attributes

ros::NodeHandle _node
 
ros::Publisher actuatorsPub
 
ros::Subscriber motorsSub
 
sensor_msgs::Joy sp_to_dynamics
 

Static Public Attributes

static constexpr char MAPPED_ACTUATOR_TOPIC [] = "/uav/actuators"
 
static constexpr char MOTORS_TOPIC [] = "/uav/actuators_raw"
 
static constexpr char SERVOS_TOPIC [] = "/uav/servo"
 

Detailed Description

Definition at line 50 of file base_mixer.hpp.

Constructor & Destructor Documentation

◆ BaseReverseMixer()

BaseReverseMixer::BaseReverseMixer ( const ros::NodeHandle nh)
inlineexplicit

Definition at line 52 of file base_mixer.hpp.

◆ ~BaseReverseMixer()

virtual BaseReverseMixer::~BaseReverseMixer ( )
virtualdefault

Member Function Documentation

◆ init()

int8_t BaseReverseMixer::init ( )
virtual

◆ motorsCallback()

virtual void BaseReverseMixer::motorsCallback ( sensor_msgs::Joy  msg)
pure virtual

Member Data Documentation

◆ _node

ros::NodeHandle BaseReverseMixer::_node

Definition at line 59 of file base_mixer.hpp.

◆ actuatorsPub

ros::Publisher BaseReverseMixer::actuatorsPub

Definition at line 57 of file base_mixer.hpp.

◆ MAPPED_ACTUATOR_TOPIC

constexpr char BaseReverseMixer::MAPPED_ACTUATOR_TOPIC[] = "/uav/actuators"
inlinestaticconstexpr

Definition at line 62 of file base_mixer.hpp.

◆ MOTORS_TOPIC

constexpr char BaseReverseMixer::MOTORS_TOPIC[] = "/uav/actuators_raw"
inlinestaticconstexpr

Definition at line 63 of file base_mixer.hpp.

◆ motorsSub

ros::Subscriber BaseReverseMixer::motorsSub

Definition at line 60 of file base_mixer.hpp.

◆ SERVOS_TOPIC

constexpr char BaseReverseMixer::SERVOS_TOPIC[] = "/uav/servo"
inlinestaticconstexpr

Definition at line 64 of file base_mixer.hpp.

◆ sp_to_dynamics

sensor_msgs::Joy BaseReverseMixer::sp_to_dynamics

Definition at line 58 of file base_mixer.hpp.


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


inno_vtol_dynamics
Author(s): Roman Fedorenko, Dmitry Ponomarev, Ezra Tal, Winter Guerra
autogenerated on Mon Dec 9 2024 03:13:35