#include "ros/this_node.h"
#include "ros/names.h"
#include "ros/node_handle.h"
#include "ros/rate.h"
#include "mutex.h"
#include "std_srvs/Empty.h"
#include "std_msgs/Int32.h"
#include "iri_wam_common_msgs/wamaction.h"
#include "iri_wam_common_msgs/obs_request.h"
Go to the source code of this file.
Classes | |
class | FixedStrategy |
Defines | |
#define | NUMPOSES 3 |
Enumerations | |
enum | { FOLDLOW, FOLDHIGH, SPREAD, FLIP, SHAKE, CHANGEPILE, MOVEAWAY, DUMMY, TAKE } |
enum | { STRAIGHT, ISOMETRIC, PEG } |
enum | { ANY, A, B } |
#define NUMPOSES 3 |
Definition at line 21 of file fixed_strategy.h.
anonymous enum |
Definition at line 23 of file fixed_strategy.h.
anonymous enum |
Definition at line 36 of file fixed_strategy.h.
anonymous enum |
Definition at line 42 of file fixed_strategy.h.