distances.cpp File Reference

#include <door_handle_detector/geometry/point.h>
#include <door_handle_detector/geometry/distances.h>
Include dependency graph for distances.cpp:

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).
 All Classes Namespaces Files Functions Variables Typedefs Defines


door_handle_detector
Author(s): Radu Bogdan Rusu, Marius
autogenerated on Fri Jan 11 09:41:57 2013