Functions
cloud_geometry::projections Namespace Reference

Functions

void pointsToPlane (const geometry_msgs::Polygon &p, geometry_msgs::Polygon &q, const std::vector< double > &plane_coefficients)
 Project a set of points onto a plane defined by ax+by+cz+d=0.
void pointsToPlane (sensor_msgs::PointCloud &p, const std::vector< int > &indices, const std::vector< double > &plane_coefficients)
 Project a set of points (in place) onto a plane defined by ax+by+cz+d=0.
void pointsToPlane (const sensor_msgs::PointCloud &p, const std::vector< int > &indices, sensor_msgs::PointCloud &q, const std::vector< double > &plane_coefficients)
 Project a set of points onto a plane defined by ax+by+cz+d=0.
void pointToPlane (const geometry_msgs::Point32 &p, geometry_msgs::Point32 &q, const std::vector< double > &plane_coefficients)
 Project a point onto a plane defined by ax+by+cz+d=0.
void pointToPlane (const geometry_msgs::Point32 &p, geometry_msgs::Point32 &q, const std::vector< double > &plane_coefficients, double &distance)
 Project a point onto a plane defined by ax+by+cz+d=0, and return the point to plane distance.

Function Documentation

void cloud_geometry::projections::pointsToPlane ( const geometry_msgs::Polygon &  p,
geometry_msgs::Polygon &  q,
const std::vector< double > &  plane_coefficients 
) [inline]

Project a set of points onto a plane defined by ax+by+cz+d=0.

Parameters:
pthe points to project
qthe resultant projected points
plane_coefficientsthe normalized coefficients (a, b, c, d) of a plane

Definition at line 72 of file projections.h.

void cloud_geometry::projections::pointsToPlane ( sensor_msgs::PointCloud p,
const std::vector< int > &  indices,
const std::vector< double > &  plane_coefficients 
) [inline]

Project a set of points (in place) onto a plane defined by ax+by+cz+d=0.

Parameters:
pthe point cloud to project (in place)
indicesuse only these point indices from the given cloud
plane_coefficientsthe normalized coefficients (a, b, c, d) of a plane

Definition at line 86 of file projections.h.

void cloud_geometry::projections::pointsToPlane ( const sensor_msgs::PointCloud p,
const std::vector< int > &  indices,
sensor_msgs::PointCloud q,
const std::vector< double > &  plane_coefficients 
) [inline]

Project a set of points onto a plane defined by ax+by+cz+d=0.

Parameters:
pthe point cloud to project
indicesuse only these point indices from the given cloud
qthe resultant projected points
plane_coefficientsthe normalized coefficients (a, b, c, d) of a plane

Definition at line 100 of file projections.h.

void cloud_geometry::projections::pointToPlane ( const geometry_msgs::Point32 &  p,
geometry_msgs::Point32 &  q,
const std::vector< double > &  plane_coefficients 
) [inline]

Project a point onto a plane defined by ax+by+cz+d=0.

Parameters:
pthe point to project
qthe resultant projected point
plane_coefficientsthe normalized coefficients (a, b, c, d) of a plane

Definition at line 53 of file projections.h.

void cloud_geometry::projections::pointToPlane ( const geometry_msgs::Point32 &  p,
geometry_msgs::Point32 &  q,
const std::vector< double > &  plane_coefficients,
double &  distance 
) [inline]

Project a point onto a plane defined by ax+by+cz+d=0, and return the point to plane distance.

Parameters:
pthe point to project
qthe resultant projected point
plane_coefficientsthe normalized coefficients (a, b, c, d) of a plane
distancethe computed distance from p to the plane

Definition at line 115 of file projections.h.



door_handle_detector
Author(s): Radu Bogdan Rusu, Marius
autogenerated on Wed Dec 11 2013 14:17:01