#include <telekyb_joystick/Joystick.hpp>
#include <linux/joystick.h>
#include <sensor_msgs/Joy.h>
#include <telekyb_base/ROS.hpp>
#include <geometry_msgs/Vector3Stamped.h>
#include <boost/algorithm/string.hpp>
#include <boost/lexical_cast.hpp>
Go to the source code of this file.
Namespaces | |
namespace | TELEKYB_NAMESPACE |
Defines | |
#define | MAX_NUMBER_AXES 20 |
#define | MAX_NUMBER_BUTTONS 50 |
#define MAX_NUMBER_AXES 20 |
Definition at line 21 of file Joystick.cpp.
#define MAX_NUMBER_BUTTONS 50 |
Definition at line 22 of file Joystick.cpp.