#include <ExplorationPlanner.h>#include "ros/ros.h"#include "hungarian.h"#include "munkres.h"#include "boost_matrix.h"#include <ros/console.h>#include <costmap_2d/costmap_2d_ros.h>#include <costmap_2d/costmap_2d.h>#include <navfn/navfn_ros.h>#include <visualization_msgs/Marker.h>#include <visualization_msgs/MarkerArray.h>#include <dynamic_reconfigure/server.h>#include <string.h>#include <stdlib.h>#include <geometry_msgs/PolygonStamped.h>#include <nav_msgs/GridCells.h>#include <adhoc_communication/ExpCluster.h>#include <adhoc_communication/ExpClusterElement.h>#include <adhoc_communication/ExpAuction.h>#include <adhoc_communication/ExpFrontier.h>#include <adhoc_communication/ExpFrontierElement.h>#include <adhoc_communication/SendExpFrontier.h>#include <adhoc_communication/SendExpAuction.h>#include <adhoc_communication/SendExpCluster.h>#include <boost/numeric/ublas/matrix.hpp>#include <boost/numeric/ublas/io.hpp>#include <adhoc_communication/MmListOfPoints.h>#include <map_merger/TransformPoint.h>#include <base_local_planner/trajectory_planner_ros.h>#include <math.h>
Go to the source code of this file.
Defines | |
| #define | CLUSTER_MERGING_DIST 0.8 |
| #define | INNER_DISTANCE 5 |
| #define | MAX_DISTANCE 2000 |
| #define | MAX_GOAL_RANGE 0.2 |
| #define | MAX_NEIGHBOR_DIST 1 |
| #define | MINIMAL_FRONTIER_RANGE 0.2 |
Functions | |
| std::vector< std::vector< int > > | array_to_matrix (int *m, int rows, int cols) |
| template<typename T > | |
| std::string | NumberToString (T Number) |
| bool | sortCluster (const ExplorationPlanner::cluster_t &lhs, const ExplorationPlanner::cluster_t &rhs) |
| bool | sortCompareElements (const ExplorationPlanner::compare_pair_t &lhs, const ExplorationPlanner::compare_pair_t &rhs) |
| #define CLUSTER_MERGING_DIST 0.8 |
Definition at line 39 of file ExplorationPlanner.cpp.
| #define INNER_DISTANCE 5 |
Definition at line 37 of file ExplorationPlanner.cpp.
| #define MAX_DISTANCE 2000 |
Definition at line 34 of file ExplorationPlanner.cpp.
| #define MAX_GOAL_RANGE 0.2 |
Definition at line 35 of file ExplorationPlanner.cpp.
| #define MAX_NEIGHBOR_DIST 1 |
Definition at line 38 of file ExplorationPlanner.cpp.
| #define MINIMAL_FRONTIER_RANGE 0.2 |
Definition at line 36 of file ExplorationPlanner.cpp.
| std::vector< std::vector<int> > array_to_matrix | ( | int * | m, |
| int | rows, | ||
| int | cols | ||
| ) |
Definition at line 3340 of file ExplorationPlanner.cpp.
| std::string NumberToString | ( | T | Number | ) |
Definition at line 44 of file ExplorationPlanner.cpp.
| bool sortCluster | ( | const ExplorationPlanner::cluster_t & | lhs, |
| const ExplorationPlanner::cluster_t & | rhs | ||
| ) |
Definition at line 4458 of file ExplorationPlanner.cpp.
| bool sortCompareElements | ( | const ExplorationPlanner::compare_pair_t & | lhs, |
| const ExplorationPlanner::compare_pair_t & | rhs | ||
| ) |
Definition at line 2197 of file ExplorationPlanner.cpp.