#include <geometry_msgs/Point32.h>#include <geometry_msgs/Polygon.h>

Go to the source code of this file.
Namespaces | |
| namespace | cloud_geometry |
| namespace | cloud_geometry::projections |
Functions | |
| 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::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 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::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 | 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. | |