#include <pcl/io/pcd_io.h>#include <pcl/point_cloud.h>#include <pcl/point_types.h>#include <pcl/console/print.h>#include <pcl/console/parse.h>#include <pcl/console/time.h>#include <pcl/common/transforms.h>#include <pcl/visualization/pcl_visualizer.h>#include <pcl/filters/voxel_grid_occlusion_estimation.h>#include <vtkCubeSource.h>#include <vtkRenderer.h>#include <vtkRenderWindow.h>#include <vtkRenderWindowInteractor.h>#include <vtkLine.h>
Go to the source code of this file.
Typedefs | |
| typedef PointCloud< PointT > | CloudT |
| typedef PointXYZ | PointT |
Functions | |
| vtkDataSet * | createDataSetFromVTKPoints (vtkPoints *points) |
| void | displayBoundingBox (Eigen::Vector3f &min_b, Eigen::Vector3f &max_b, vtkSmartPointer< vtkActorCollection > coll) |
| vtkSmartPointer< vtkPolyData > | getCuboid (double minX, double maxX, double minY, double maxY, double minZ, double maxZ) |
| void | getVoxelActors (pcl::PointCloud< pcl::PointXYZ > &voxelCenters, double voxelSideLen, Eigen::Vector3f color, vtkSmartPointer< vtkActorCollection > coll) |
| int | main (int argc, char **argv) |
| void | printHelp (int, char **argv) |
Variables | |
| float | default_leaf_size = 0.01f |
| typedef PointCloud<PointT> CloudT |
Definition at line 60 of file tools/voxel_grid_occlusion_estimation.cpp.
Definition at line 59 of file tools/voxel_grid_occlusion_estimation.cpp.
| vtkDataSet* createDataSetFromVTKPoints | ( | vtkPoints * | points | ) |
Definition at line 65 of file tools/voxel_grid_occlusion_estimation.cpp.
| void displayBoundingBox | ( | Eigen::Vector3f & | min_b, |
| Eigen::Vector3f & | max_b, | ||
| vtkSmartPointer< vtkActorCollection > | coll | ||
| ) |
Definition at line 118 of file tools/voxel_grid_occlusion_estimation.cpp.
| vtkSmartPointer<vtkPolyData> getCuboid | ( | double | minX, |
| double | maxX, | ||
| double | minY, | ||
| double | maxY, | ||
| double | minZ, | ||
| double | maxZ | ||
| ) |
Definition at line 79 of file tools/voxel_grid_occlusion_estimation.cpp.
| void getVoxelActors | ( | pcl::PointCloud< pcl::PointXYZ > & | voxelCenters, |
| double | voxelSideLen, | ||
| Eigen::Vector3f | color, | ||
| vtkSmartPointer< vtkActorCollection > | coll | ||
| ) |
Definition at line 87 of file tools/voxel_grid_occlusion_estimation.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 145 of file tools/voxel_grid_occlusion_estimation.cpp.
| void printHelp | ( | int | , |
| char ** | argv | ||
| ) |
Definition at line 137 of file tools/voxel_grid_occlusion_estimation.cpp.
| float default_leaf_size = 0.01f |
Definition at line 62 of file tools/voxel_grid_occlusion_estimation.cpp.