#include <LLJoystick.hpp>
Public Member Functions | |
void | joystickCB (const sensor_msgs::Joy::ConstPtr &msg) |
LLJoystick () | |
void | run () |
virtual | ~LLJoystick () |
Private Attributes | |
ros::Subscriber | joystick |
ros::Publisher | llCommand |
ros::NodeHandle | nodeHandle |
LLJoystickOptions | options |
int | pitchCmd |
int | rollCmd |
int | thrustCmd |
int | yawCmd |
Definition at line 21 of file LLJoystick.hpp.
Definition at line 39 of file LLJoystick.cpp.
TELEKYB_NAMESPACE::LLJoystick::~LLJoystick | ( | ) | [virtual] |
Definition at line 49 of file LLJoystick.cpp.
void TELEKYB_NAMESPACE::LLJoystick::joystickCB | ( | const sensor_msgs::Joy::ConstPtr & | msg | ) |
Definition at line 55 of file LLJoystick.cpp.
void TELEKYB_NAMESPACE::LLJoystick::run | ( | ) |
Definition at line 77 of file LLJoystick.cpp.
Definition at line 26 of file LLJoystick.hpp.
Definition at line 27 of file LLJoystick.hpp.
Definition at line 25 of file LLJoystick.hpp.
Definition at line 23 of file LLJoystick.hpp.
int TELEKYB_NAMESPACE::LLJoystick::pitchCmd [private] |
Definition at line 30 of file LLJoystick.hpp.
int TELEKYB_NAMESPACE::LLJoystick::rollCmd [private] |
Definition at line 29 of file LLJoystick.hpp.
int TELEKYB_NAMESPACE::LLJoystick::thrustCmd [private] |
Definition at line 32 of file LLJoystick.hpp.
int TELEKYB_NAMESPACE::LLJoystick::yawCmd [private] |
Definition at line 31 of file LLJoystick.hpp.