#include <sstream>#include <string>#include <ros/ros.h>#include <ros/package.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_srvs/Empty.h>#include "PatrolAgent.h"
Go to the source code of this file.
Defines | |
| #define | DELTA_TIME_SEQUENTIAL_START 15 |
Variables | |
| const std::string | PS_path = ros::package::getPath("patrolling_sim") |
| #define DELTA_TIME_SEQUENTIAL_START 15 |
Definition at line 54 of file PatrolAgent.cpp.
| const std::string PS_path = ros::package::getPath("patrolling_sim") |
Definition at line 56 of file PatrolAgent.cpp.