#include <math.h>
#include <algorithm>
#include <functional>
#include <vector>
#include <iterator>
#include <boost/shared_ptr.hpp>
#include <visualization_msgs/Marker.h>
#include <geometry_msgs/Point.h>
#include <std_msgs/ColorRGBA.h>
#include <ros/console.h>
#include <ros/ros.h>
#include <teb_local_planner/planner_interface.h>
#include <teb_local_planner/teb_config.h>
#include <teb_local_planner/obstacles.h>
#include <teb_local_planner/optimal_planner.h>
#include <teb_local_planner/visualization.h>
#include <teb_local_planner/robot_footprint_model.h>
#include <teb_local_planner/equivalence_relations.h>
#include <teb_local_planner/graph_search.h>
#include <teb_local_planner/homotopy_class_planner.hpp>
Go to the source code of this file.
|
class | teb_local_planner::HomotopyClassPlanner |
| Local planner that explores alternative homotopy classes, create a plan for each alternative and finally return the robot controls for the current best path (repeated in each sampling interval) More...
|
|