#include <sstream>
#include <string>
#include <vector>
#include <ros/ros.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <actionlib/client/simple_action_client.h>
#include <tf/transform_broadcaster.h>
#include <tf/transform_listener.h>
#include <nav_msgs/Odometry.h>
#include <std_msgs/Int16MultiArray.h>
#include "getgraph.h"
#include "message_types.h"
Go to the source code of this file.
Classes | |
class | PatrolAgent |
Defines | |
#define | INTERFERENCE_DISTANCE 2 |
#define | NUM_MAX_ROBOTS 32 |
Typedefs | |
typedef actionlib::SimpleActionClient < move_base_msgs::MoveBaseAction > | MoveBaseClient |
typedef unsigned int | uint |
#define INTERFERENCE_DISTANCE 2 |
Definition at line 53 of file PatrolAgent.h.
#define NUM_MAX_ROBOTS 32 |
Definition at line 52 of file PatrolAgent.h.
typedef actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> MoveBaseClient |
Definition at line 58 of file PatrolAgent.h.
typedef unsigned int uint |
Definition at line 57 of file PatrolAgent.h.