#include <door_handle_detector/geometry/point.h>#include <door_handle_detector/geometry/areas.h>#include <door_handle_detector/geometry/distances.h>#include <door_handle_detector/geometry/transforms.h>#include <door_handle_detector/geometry/intersections.h>#include <Eigen/Core>#include <Eigen/Geometry>#include <cfloat>#include <algorithm>
Go to the source code of this file.
Namespaces | |
| namespace | cloud_geometry |
| namespace | cloud_geometry::areas |
Functions | |
| double | cloud_geometry::areas::compute2DPolygonalArea (const sensor_msgs::PointCloud &points, const std::vector< double > &normal) |
| Compute the area of a 2D planar polygon patch - using a given normal. | |
| double | cloud_geometry::areas::compute2DPolygonalArea (const geometry_msgs::Polygon &polygon, const std::vector< double > &normal) |
| Compute the area of a 2D planar polygon patch - using a given normal. | |
| double | cloud_geometry::areas::compute2DPolygonalArea (const geometry_msgs::Polygon &polygon) |
| Compute the area of a 2D planar polygon patch. The normal is computed automatically. | |
| bool | cloud_geometry::areas::compute2DPolygonNormal (const geometry_msgs::Polygon &poly, std::vector< double > &normal) |
| void | cloud_geometry::areas::convexHull2D (const sensor_msgs::PointCloud &points, const std::vector< int > &indices, const std::vector< double > &coeff, geometry_msgs::Polygon &hull) |
| Compute a 2D convex hull in 3D space using Andrew's monotone chain algorithm. | |
| void | cloud_geometry::areas::convexHull2D (const std::vector< geometry_msgs::Point32 > &points, geometry_msgs::Polygon &hull) |
| Compute a 2D convex hull using Andrew's monotone chain algorithm. | |
| bool | cloud_geometry::areas::isPointIn2DPolygon (const geometry_msgs::Point32 &point, const geometry_msgs::Polygon &polygon) |
| Check if a 2d point (X and Y coordinates considered only!) is inside or outisde a given polygon. | |