#include <stereo_wall_detection/geometry/point.h>
#include <stereo_wall_detection/geometry/distances.h>
Go to the source code of this file.
Namespaces | |
namespace | cloud_geometry |
namespace | cloud_geometry::distances |
Functions | |
void | cloud_geometry::distances::lineToLineSegment (const std::vector< double > &line_a, const std::vector< double > &line_b, std::vector< double > &segment) |
Get the shortest 3D segment between two 3D lines. | |
double | cloud_geometry::distances::pointToLineDistance (const geometry_msgs::Point32 &p, const std::vector< double > &line_coefficients) |
Get the distance from a point to a line (represented by a point and a direction). | |
double | cloud_geometry::distances::pointToLineDistance (const geometry_msgs::Point32 &p, const geometry_msgs::Point32 &q, const geometry_msgs::Point32 &dir) |
Get the distance from a point to a line (represented by a point and a direction). |