#include "door_handle_detector/geometry/point.h"
#include "door_handle_detector/geometry/intersections.h"
#include "door_handle_detector/geometry/distances.h"
#include <cfloat>
Go to the source code of this file.
Namespaces | |
namespace | cloud_geometry |
namespace | cloud_geometry::intersections |
Functions | |
bool | cloud_geometry::intersections::lineToBoxIntersection (const std::vector< double > &line, const std::vector< double > &cube) |
Bounding box intersection modified from Graphics Gems Vol I. The method returns a non-zero value if the bounding box is hit. | |
bool | cloud_geometry::intersections::lineToCircleIntersection (const std::vector< double > &line, const std::vector< double > &circle) |
Check the intersection between a line segment and a circle. | |
bool | cloud_geometry::intersections::lineWithLineIntersection (const std::vector< double > &line_a, const std::vector< double > &line_b, geometry_msgs::Point32 &point, double sqr_eps) |
Get the intersection of a two 3D lines in space as a 3D point. | |
bool | cloud_geometry::intersections::lineWithPlaneIntersection (const std::vector< double > &plane, const std::vector< double > &line, geometry_msgs::Point32 &point) |
Get the intersection of a plane and a line in 3D space as a point. | |
bool | cloud_geometry::intersections::planeWithCubeIntersection (const std::vector< double > &plane, const std::vector< double > &cube, geometry_msgs::Polygon &polygon) |
Obtain the intersection of a plane with an axis-aligned cube as a (sorted) 2D polygon. | |
bool | cloud_geometry::intersections::planeWithPlaneIntersection (const std::vector< double > &plane_a, const std::vector< double > &plane_b, std::vector< double > &line) |
Get the intersection of two planes in 3D space as a 3D line. |