#include <algorithm>#include <boost/foreach.hpp>#include <ros/ros.h>#include <pcl_conversions/pcl_conversions.h>#include <pcl/io/vtk_io.h>#include <pcl/point_types.h>#include <pcl/kdtree/kdtree_flann.h>#include <pcl/surface/mls.h>#include <pcl/surface/impl/mls.hpp>#include <pcl/surface/convex_hull.h>#include <sensor_msgs/point_cloud_conversion.h>#include <triangulate_point_cloud/TriangulatePCL.h>#include <shape_msgs/Mesh.h>#include <shape_msgs/MeshTriangle.h>#include <geometry_msgs/Point.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char *argv[]) |
| bool | onTriangulatePcl (TriangulatePCL::Request &req, TriangulatePCL::Response &res) |
| template<typename T > | |
| void | polygonMeshToShapeMsg (const PointCloud< T > &points, const std::vector< Vertices > &triangles, shape_msgs::Mesh &mesh) |
| void | reconstructMesh (const PointCloud< PointXYZ >::ConstPtr &cloud, PointCloud< PointXYZ > &output_cloud, std::vector< Vertices > &triangles) |
| void | test () |
| template<typename T > | |
| void | toPoint (const T &in, geometry_msgs::Point &out) |
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 162 of file triangulate_pcl.cpp.
| bool onTriangulatePcl | ( | TriangulatePCL::Request & | req, |
| TriangulatePCL::Response & | res | ||
| ) |
Definition at line 116 of file triangulate_pcl.cpp.
| void polygonMeshToShapeMsg | ( | const PointCloud< T > & | points, |
| const std::vector< Vertices > & | triangles, | ||
| shape_msgs::Mesh & | mesh | ||
| ) |
Definition at line 91 of file triangulate_pcl.cpp.
| void reconstructMesh | ( | const PointCloud< PointXYZ >::ConstPtr & | cloud, |
| PointCloud< PointXYZ > & | output_cloud, | ||
| std::vector< Vertices > & | triangles | ||
| ) |
Definition at line 54 of file triangulate_pcl.cpp.
| void test | ( | ) |
Definition at line 140 of file triangulate_pcl.cpp.
| void toPoint | ( | const T & | in, |
| geometry_msgs::Point & | out | ||
| ) |
Definition at line 83 of file triangulate_pcl.cpp.