projections.h File Reference

#include <geometry_msgs/Point32.h>
#include <geometry_msgs/Polygon.h>
Include dependency graph for projections.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  cloud_geometry
namespace  cloud_geometry::projections

Functions

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)
 Project a set of points onto a plane defined by ax+by+cz+d=0.
void cloud_geometry::projections::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 cloud_geometry::projections::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 cloud_geometry::projections::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.
void cloud_geometry::projections::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.
 All Classes Namespaces Files Functions Variables Typedefs Defines


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