#include <ros/ros.h>#include <move_base_msgs/MoveBaseAction.h>#include <actionlib/client/simple_action_client.h>#include <tf/transform_broadcaster.h>#include <geometry_msgs/PointStamped.h>#include <float.h>#include "getgraph.h"
Go to the source code of this file.
Defines | |
| #define | NUM_MAX_ROBOTS 32 |
Typedefs | |
| typedef unsigned int | uint |
Functions | |
| uint | calculate_patrol_cycle (uint *nr_visits, uint dimension) |
| void | finish_simulation () |
| int | main (int argc, char **argv) |
| double | Median (double *a, uint dimension) |
| void | resultsCB (const geometry_msgs::PointStamped::ConstPtr &msg) |
| void | write_results (double *avg_idleness, uint *number_of_visits, uint complete_patrol, uint dimension, double worst_idleness, double avg_graph_idl, double median_graph_idl, uint interference_count, char *graph_file, char *algorithm, char *teamsize_str, double timevalue) |
Variables | |
| uint | count = 0 |
| int | goal |
| bool | goal_reached = false |
| bool | init_robots [NUM_MAX_ROBOTS] |
| bool | initialize = true |
| bool | interference = false |
| ros::Publisher | results_pub |
| ros::Subscriber | results_sub |
| uint | teamsize |
| double | time_zero |
| #define NUM_MAX_ROBOTS 32 |
Definition at line 47 of file monitor.cpp.
| typedef unsigned int uint |
Definition at line 49 of file monitor.cpp.
| uint calculate_patrol_cycle | ( | uint * | nr_visits, |
| uint | dimension | ||
| ) |
Definition at line 273 of file monitor.cpp.
| void finish_simulation | ( | ) |
Definition at line 136 of file monitor.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 336 of file monitor.cpp.
Definition at line 147 of file monitor.cpp.
| void resultsCB | ( | const geometry_msgs::PointStamped::ConstPtr & | msg | ) |
Definition at line 66 of file monitor.cpp.
| void write_results | ( | double * | avg_idleness, |
| uint * | number_of_visits, | ||
| uint | complete_patrol, | ||
| uint | dimension, | ||
| double | worst_idleness, | ||
| double | avg_graph_idl, | ||
| double | median_graph_idl, | ||
| uint | interference_count, | ||
| char * | graph_file, | ||
| char * | algorithm, | ||
| char * | teamsize_str, | ||
| double | timevalue | ||
| ) |
Definition at line 285 of file monitor.cpp.
Definition at line 56 of file monitor.cpp.
| int goal |
Definition at line 63 of file monitor.cpp.
| bool goal_reached = false |
Definition at line 62 of file monitor.cpp.
| bool init_robots[NUM_MAX_ROBOTS] |
Definition at line 58 of file monitor.cpp.
| bool initialize = true |
Definition at line 55 of file monitor.cpp.
| bool interference = false |
Definition at line 61 of file monitor.cpp.
Definition at line 52 of file monitor.cpp.
Definition at line 51 of file monitor.cpp.
Definition at line 57 of file monitor.cpp.
| double time_zero |
Definition at line 64 of file monitor.cpp.