#include <ros/ros.h>
#include <actionlib/server/simple_action_server.h>
#include <tf/transform_broadcaster.h>
#include <geometry_msgs/Twist.h>
#include <roomba_500_series/IRCharacter.h>
#include <roomba_500_series/Battery.h>
#include <roomba_500_series/GoDockAction.h>
Go to the source code of this file.
Classes | |
class | GoDockAction |
Defines | |
#define | FORCE_FIELD 161 |
#define | GREEN_BUOY 164 |
#define | GREEN_BUOY_FORCE_FIELD 165 |
#define | RED_BUOY 168 |
#define | RED_BUOY_FORCE_FIELD 169 |
#define | RED_BUOY_GREEN_BUOY 172 |
#define | RED_BUOY_GREEN_BUOY_FORCE_FIELD 173 |
#define | VIRTUAL_WALL 162 |
#define FORCE_FIELD 161 |
#define GREEN_BUOY 164 |
#define GREEN_BUOY_FORCE_FIELD 165 |
#define RED_BUOY_FORCE_FIELD 169 |
#define RED_BUOY_GREEN_BUOY 172 |
#define RED_BUOY_GREEN_BUOY_FORCE_FIELD 173 |
#define VIRTUAL_WALL 162 |