#include <cmath>
#include <cstring>
#include <vector>
#include <CGAL/Exact_predicates_inexact_constructions_kernel.h>
#include <CGAL/Delaunay_triangulation_2.h>
#include <CGAL/Polygon_2.h>
#include <ros/ros.h>
#include <geometry_msgs/Polygon.h>
#include <lama_common/place_profile_utils.h>
#include <lama_msgs/Crossing.h>
#include <lama_msgs/Frontier.h>
#include <lama_msgs/PlaceProfile.h>
Go to the source code of this file.
Classes | |
class | crossing_detector::CrossingDetector |
Namespaces | |
namespace | crossing_detector |
Typedefs | |
typedef CGAL::Delaunay_triangulation_2 < K > | crossing_detector::Delaunay |
typedef Delaunay::Face_iterator | crossing_detector::Face_iterator |
typedef CGAL::Exact_predicates_inexact_constructions_kernel | crossing_detector::K |
typedef K::Point_2 | crossing_detector::Point |
typedef CGAL::Polygon_2< K > | crossing_detector::Polygon |