#include "ros/ros.h"#include "sensor_msgs/JoyFeedbackArray.h"#include "std_srvs/Empty.h"#include "sensor_msgs/Imu.h"#include "wiimote/stat_vector_3d.h"#include <bluetooth/bluetooth.h>#include <cwiid.h>

Go to the source code of this file.
Classes | |
| class | WiimoteNode |
Namespaces | |
| wiimote_c | |
Macros | |
| #define | WIIMOTE_WIIMOTE_CONTROLLER_H |
| #define | zeroedByCal(raw, zero, one) (((raw - zero) * 1.0) / ((one - zero) * 1.0)) |
| #define WIIMOTE_WIIMOTE_CONTROLLER_H |
Definition at line 39 of file wiimote_controller.h.
| #define zeroedByCal | ( | raw, | |
| zero, | |||
| one | |||
| ) | (((raw - zero) * 1.0) / ((one - zero) * 1.0)) |
Definition at line 55 of file wiimote_controller.h.