#include <JoystickDemo.h>
Public Member Functions | |
JoystickDemo (ros::NodeHandle &node, ros::NodeHandle &priv_nh) | |
Private Types | |
enum | { BTN_PARK = 3, BTN_REVERSE = 1, BTN_NEUTRAL = 2, BTN_DRIVE = 0, BTN_ENABLE = 5, BTN_DISABLE = 4, BTN_STEER_MULT_1 = 6, BTN_STEER_MULT_2 = 7, BTN_COUNT = 11, AXIS_ACCELERATOR_PEDAL = 5, AXIS_BRAKE = 2, AXIS_STEER_1 = 0, AXIS_STEER_2 = 3, AXIS_TURN_SIG = 6, AXIS_COUNT = 8 } |
Private Member Functions | |
void | cmdCallback (const ros::TimerEvent &event) |
void | recvJoy (const sensor_msgs::Joy::ConstPtr &msg) |
Private Attributes | |
bool | count_ |
uint8_t | counter_ |
JoystickDataStruct | data_ |
bool | enable_ |
bool | ignore_ |
sensor_msgs::Joy | joy_ |
ros::Publisher | pub_accelerator_pedal_ |
ros::Publisher | pub_brake_ |
ros::Publisher | pub_disable_ |
ros::Publisher | pub_enable_ |
ros::Publisher | pub_gear_ |
ros::Publisher | pub_global_enable_ |
ros::Publisher | pub_misc_ |
ros::Publisher | pub_steering_ |
ros::Subscriber | sub_joy_ |
double | svel_ |
ros::Timer | timer_ |
Definition at line 66 of file JoystickDemo.h.
anonymous enum [private] |
BTN_PARK | |
BTN_REVERSE | |
BTN_NEUTRAL | |
BTN_DRIVE | |
BTN_ENABLE | |
BTN_DISABLE | |
BTN_STEER_MULT_1 | |
BTN_STEER_MULT_2 | |
BTN_COUNT | |
AXIS_ACCELERATOR_PEDAL | |
AXIS_BRAKE | |
AXIS_STEER_1 | |
AXIS_STEER_2 | |
AXIS_TURN_SIG | |
AXIS_COUNT |
Definition at line 95 of file JoystickDemo.h.
joystick_demo::JoystickDemo::JoystickDemo | ( | ros::NodeHandle & | node, |
ros::NodeHandle & | priv_nh | ||
) |
Definition at line 41 of file JoystickDemo.cpp.
void joystick_demo::JoystickDemo::cmdCallback | ( | const ros::TimerEvent & | event | ) | [private] |
Definition at line 81 of file JoystickDemo.cpp.
void joystick_demo::JoystickDemo::recvJoy | ( | const sensor_msgs::Joy::ConstPtr & | msg | ) | [private] |
Definition at line 153 of file JoystickDemo.cpp.
bool joystick_demo::JoystickDemo::count_ [private] |
Definition at line 86 of file JoystickDemo.h.
uint8_t joystick_demo::JoystickDemo::counter_ [private] |
Definition at line 93 of file JoystickDemo.h.
Definition at line 91 of file JoystickDemo.h.
bool joystick_demo::JoystickDemo::enable_ [private] |
Definition at line 85 of file JoystickDemo.h.
bool joystick_demo::JoystickDemo::ignore_ [private] |
Definition at line 84 of file JoystickDemo.h.
sensor_msgs::Joy joystick_demo::JoystickDemo::joy_ [private] |
Definition at line 92 of file JoystickDemo.h.
Definition at line 75 of file JoystickDemo.h.
Definition at line 76 of file JoystickDemo.h.
Definition at line 81 of file JoystickDemo.h.
Definition at line 80 of file JoystickDemo.h.
Definition at line 78 of file JoystickDemo.h.
Definition at line 82 of file JoystickDemo.h.
Definition at line 79 of file JoystickDemo.h.
Definition at line 77 of file JoystickDemo.h.
Definition at line 74 of file JoystickDemo.h.
double joystick_demo::JoystickDemo::svel_ [private] |
Definition at line 87 of file JoystickDemo.h.
Definition at line 90 of file JoystickDemo.h.