#include <pcl/kdtree/kdtree_flann.h>
#include <pcl/surface/mls.h>
#include <pcl/surface/convex_hull.h>
#include <pcl/surface/concave_hull.h>
#include <pcl/surface/gp3.h>
#include <pcl/surface/marching_cubes_hoppe.h>
#include "typedefs.h"
Go to the source code of this file.
Classes | |
class | Mesh |
Typedefs | |
typedef boost::shared_ptr< Mesh > | MeshPtr |
Functions | |
MeshPtr | computeConcaveHull (const PointCloudPtr &input, float alpha) |
MeshPtr | computeConvexHull (const PointCloudPtr &input) |
SurfaceElementsPtr | computeSurfaceElements (const PointCloudPtr &input, float radius, int polynomial_order) |
pcl::PolygonMesh::Ptr | greedyTriangulation (const SurfaceElementsPtr &surfels, float radius, float mu, int max_nearest_neighbors, float max_surface_angle, float min_angle, float max_angle) |
pcl::PolygonMesh::Ptr | marchingCubesTriangulation (const SurfaceElementsPtr &surfels, float leaf_size, float iso_level) |
PointCloudPtr | smoothPointCloud (const PointCloudPtr &input, float radius, int polynomial_order) |
Definition at line 22 of file iros2011/include/surface.h.
MeshPtr computeConcaveHull | ( | const PointCloudPtr & | input, |
float | alpha | ||
) |
Definition at line 47 of file iros2011/include/surface.h.
MeshPtr computeConvexHull | ( | const PointCloudPtr & | input | ) |
Definition at line 39 of file iros2011/include/surface.h.
SurfaceElementsPtr computeSurfaceElements | ( | const PointCloudPtr & | input, |
float | radius, | ||
int | polynomial_order | ||
) |
Definition at line 32 of file iros2011/include/surface.h.
pcl::PolygonMesh::Ptr greedyTriangulation | ( | const SurfaceElementsPtr & | surfels, |
float | radius, | ||
float | mu, | ||
int | max_nearest_neighbors, | ||
float | max_surface_angle, | ||
float | min_angle, | ||
float | max_angle | ||
) |
Definition at line 54 of file iros2011/include/surface.h.
pcl::PolygonMesh::Ptr marchingCubesTriangulation | ( | const SurfaceElementsPtr & | surfels, |
float | leaf_size, | ||
float | iso_level | ||
) |
Definition at line 64 of file iros2011/include/surface.h.
PointCloudPtr smoothPointCloud | ( | const PointCloudPtr & | input, |
float | radius, | ||
int | polynomial_order | ||
) |
Definition at line 25 of file iros2011/include/surface.h.