#include <sstream>
#include <string>
#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 <algorithm>
#include <stdio.h>
#include "PatrolAgent.h"
#include "algorithms.h"
#include "config.h"
Go to the source code of this file.
Classes | |
struct | bid_tuple |
class | SSIPatrolAgent |
Defines | |
#define | BIG_NUMBER 999999 |
#define | CONFIG_FILENAME "params/DTA/DTASSI.params" |
#define | DEBUG_PRINT 0 |
Typedefs | |
typedef struct bid_tuple | bid_tuple |
#define BIG_NUMBER 999999 |
Definition at line 57 of file SSIPatrolAgent.h.
#define CONFIG_FILENAME "params/DTA/DTASSI.params" |
Definition at line 55 of file SSIPatrolAgent.h.
#define DEBUG_PRINT 0 |
Definition at line 59 of file SSIPatrolAgent.h.