#include "shape_reconstruction/ShapeRecPlotter.h"#include <pcl/conversions.h>#include <pcl/io/pcd_io.h>#include <pcl/filters/filter_indices.h>#include <sensor_msgs/Image.h>#include <opencv2/imgproc/imgproc.hpp>#include <opencv2/video/tracking.hpp>#include <opencv2/highgui/highgui.hpp>#include <pcl_conversions/pcl_conversions.h>#include <ros/package.h>#include <cmath>#include <ros/console.h>#include "shape_reconstruction/RangeImagePlanar.hpp"#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <pcl/visualization/pcl_visualizer.h>#include <pcl/filters/passthrough.h>#include <boost/filesystem.hpp>#include <ctime>#include <std_msgs/Bool.h>#include <iostream>#include <pcl/common/common.h>#include <pcl/io/ply_io.h>#include <pcl/search/kdtree.h>#include <pcl/features/normal_3d_omp.h>#include <pcl/surface/mls.h>#include <pcl/surface/poisson.h>#include <pcl/surface/marching_cubes.h>#include <pcl/surface/marching_cubes_rbf.h>#include <pcl/surface/marching_cubes_hoppe.h>#include <pcl/surface/ear_clipping.h>#include <pcl/surface/vtk_smoothing/vtk_mesh_smoothing_laplacian.h>#include <pcl/surface/vtk_smoothing/vtk_mesh_smoothing_windowed_sinc.h>#include <pcl/surface/vtk_smoothing/vtk_mesh_subdivision.h>#include <pcl/io/vtk_lib_io.h>#include <vcg/complex/complex.h>#include <vcg/complex/all_types.h>#include <vcg/complex/algorithms/clean.h>#include <vcg/complex/algorithms/update/bounding.h>#include <vcg/complex/algorithms/update/normal.h>#include <vcg/complex/algorithms/update/topology.h>#include <pcl/surface/convex_hull.h>#include <pcl/surface/concave_hull.h>#include <pcl/filters/normal_refinement.h>#include <pcl/surface/simplification_remove_unused_vertices.h>#include <sensor_msgs/PointCloud2.h>#include <geometry_msgs/TransformStamped.h>#include <pcl_ros/transforms.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 184 of file ShapeRecPlotter.cpp.