#include "shape_reconstruction/ShapeReconstructionNode.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>
Go to the source code of this file.
Typedefs | |
| typedef pcl::PointCloud< PointT > | PointCloudT |
| typedef pcl::PointCloud< PointT2 > | PointCloudT2 |
| typedef pcl::PointCloud< PointLT > | PointLCloudT |
| typedef pcl::PointXYZL | PointLT |
| typedef pcl::PointCloud< PointNT > | PointNCloudT |
| typedef pcl::PointNormal | PointNT |
| typedef pcl::PointXYZRGB | PointT |
| typedef pcl::PointXYZRGBA | PointT2 |
Functions | |
| int | main (int argc, char **argv) |
| typedef pcl::PointCloud<PointT> PointCloudT |
Definition at line 611 of file ShapeReconstructionNode.cpp.
| typedef pcl::PointCloud<PointT2> PointCloudT2 |
Definition at line 613 of file ShapeReconstructionNode.cpp.
| typedef pcl::PointCloud<PointLT> PointLCloudT |
Definition at line 617 of file ShapeReconstructionNode.cpp.
| typedef pcl::PointXYZL PointLT |
Definition at line 616 of file ShapeReconstructionNode.cpp.
| typedef pcl::PointCloud<PointNT> PointNCloudT |
Definition at line 615 of file ShapeReconstructionNode.cpp.
| typedef pcl::PointNormal PointNT |
Definition at line 614 of file ShapeReconstructionNode.cpp.
| typedef pcl::PointXYZRGB PointT |
Definition at line 610 of file ShapeReconstructionNode.cpp.
| typedef pcl::PointXYZRGBA PointT2 |
Definition at line 612 of file ShapeReconstructionNode.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 804 of file ShapeReconstructionNode.cpp.