#include <pcl17/console/print.h>
#include <iostream>
#include <boost/filesystem.hpp>
#include <boost/random.hpp>
#include <pcl17/point_types.h>
#include <pcl17/point_cloud.h>
#include <pcl17/console/parse.h>
#include <pcl17/io/vtk_lib_io.h>
#include <pcl17/io/pcd_io.h>
#include <pcl17/common/transforms.h>
#include <pcl17/visualization/pcl_visualizer.h>
#include <pcl17/filters/voxel_grid.h>
#include <pcl17/sample_consensus/ransac.h>
#include <pcl17/search/kdtree.h>
#include <pcl17/surface/mls.h>
#include <vtkTriangle.h>
#include <vtkTriangleFilter.h>
#include <vtkPolyDataMapper.h>
Go to the source code of this file.
Functions |
void | addNoise (pcl17::PointCloud< pcl17::PointXYZ >::Ptr cloud, double noise_std) |
void | createFullModelPointcloud (vtkSmartPointer< vtkPolyData > polydata, size_t n_samples, pcl17::PointCloud< pcl17::PointXYZ > &cloud_out) |
int | main (int argc, char **argv) |
void | moveToNewCenterAndAlign (pcl17::PointCloud< pcl17::PointXYZ >::Ptr cloud, pcl17::PointCloud< pcl17::PointXYZ >::Ptr cloud_transformed, double new_center[3], double tilt_angle) |
void | randomPointTriangle (float a1, float a2, float a3, float b1, float b2, float b3, float c1, float c2, float c3, Eigen::Vector4f &p) |
void | randPSurface (vtkPolyData *polydata, std::vector< double > *cumulativeAreas, double totalArea, Eigen::Vector4f &p) |
double | uniform_deviate (int seed) |
void | uniform_sampling (vtkSmartPointer< vtkPolyData > polydata, size_t n_samples, pcl17::PointCloud< pcl17::PointXYZ > &cloud_out) |
Function Documentation
void randomPointTriangle |
( |
float |
a1, |
|
|
float |
a2, |
|
|
float |
a3, |
|
|
float |
b1, |
|
|
float |
b2, |
|
|
float |
b3, |
|
|
float |
c1, |
|
|
float |
c2, |
|
|
float |
c3, |
|
|
Eigen::Vector4f & |
p |
|
) |
| [inline] |
void randPSurface |
( |
vtkPolyData * |
polydata, |
|
|
std::vector< double > * |
cumulativeAreas, |
|
|
double |
totalArea, |
|
|
Eigen::Vector4f & |
p |
|
) |
| [inline] |