Skip to content

Instantly share code, notes, and snippets.

@r-ryantm
Created March 23, 2020 02:35
Show Gist options
  • Star 0 You must be signed in to star a gist
  • Fork 0 You must be signed in to fork a gist
  • Save r-ryantm/ffb1270cb323b05c9feece151166ddc2 to your computer and use it in GitHub Desktop.
Save r-ryantm/ffb1270cb323b05c9feece151166ddc2 to your computer and use it in GitHub Desktop.
/nix/store/y1c2x6szh0gfgv53j7r8gqbf9fmpvxw5-pcl-1.10.1
├── bin
│   ├── pcl_add_gaussian_noise
│   ├── pcl_boundary_estimation
│   ├── pcl_cluster_extraction
│   ├── pcl_compute_cloud_error
│   ├── pcl_compute_hausdorff
│   ├── pcl_compute_hull
│   ├── pcl_concatenate_points_pcd
│   ├── pcl_converter
│   ├── pcl_convert_pcd_ascii_binary
│   ├── pcl_crf_segmentation
│   ├── pcl_crop_to_hull
│   ├── pcl_demean_cloud
│   ├── pcl_elch
│   ├── pcl_extract_feature
│   ├── pcl_fast_bilateral_filter
│   ├── pcl_fpfh_estimation
│   ├── pcl_generate
│   ├── pcl_gp3_surface
│   ├── pcl_grid_min
│   ├── pcl_hdl_grabber
│   ├── pcl_hdl_viewer_simple
│   ├── pcl_icp
│   ├── pcl_icp2d
│   ├── pcl_linemod_detection
│   ├── pcl_local_max
│   ├── pcl_lum
│   ├── pcl_marching_cubes_reconstruction
│   ├── pcl_match_linemod_template
│   ├── pcl_mesh2pcd
│   ├── pcl_mesh_sampling
│   ├── pcl_mls_smoothing
│   ├── pcl_morph
│   ├── pcl_ndt2d
│   ├── pcl_ndt3d
│   ├── pcl_normal_estimation
│   ├── pcl_obj2pcd
│   ├── pcl_obj2ply
│   ├── pcl_obj2vtk
│   ├── pcl_obj_rec_ransac_accepted_hypotheses
│   ├── pcl_obj_rec_ransac_hash_table
│   ├── pcl_obj_rec_ransac_model_opps
│   ├── pcl_obj_rec_ransac_orr_octree
│   ├── pcl_obj_rec_ransac_orr_octree_zprojection
│   ├── pcl_obj_rec_ransac_result
│   ├── pcl_obj_rec_ransac_scene_opps
│   ├── pcl_octree_viewer
│   ├── pcl_organized_pcd_to_png
│   ├── pcl_outlier_removal
│   ├── pcl_outofcore_print
│   ├── pcl_outofcore_process
│   ├── pcl_outofcore_viewer
│   ├── pcl_passthrough_filter
│   ├── pcl_pcd2ply
│   ├── pcl_pcd2png
│   ├── pcl_pcd2vtk
│   ├── pcl_pcd_change_viewpoint
│   ├── pcl_pcd_convert_NaN_nan
│   ├── pcl_pcd_image_viewer
│   ├── pcl_pcd_introduce_nan
│   ├── pcl_pclzf2pcd
│   ├── pcl_plane_projection
│   ├── pcl_ply2obj
│   ├── pcl_ply2pcd
│   ├── pcl_ply2ply
│   ├── pcl_ply2raw
│   ├── pcl_ply2vtk
│   ├── pcl_plyheader
│   ├── pcl_png2pcd
│   ├── pcl_poisson_reconstruction
│   ├── pcl_progressive_morphological_filter
│   ├── pcl_radius_filter
│   ├── pcl_registration_visualizer
│   ├── pcl_sac_segmentation_plane
│   ├── pcl_spin_estimation
│   ├── pcl_tiff2pcd
│   ├── pcl_timed_trigger_test
│   ├── pcl_train_linemod_template
│   ├── pcl_train_unary_classifier
│   ├── pcl_transform_from_viewpoint
│   ├── pcl_transform_point_cloud
│   ├── pcl_unary_classifier_segment
│   ├── pcl_uniform_sampling
│   ├── pcl_vfh_estimation
│   ├── pcl_viewer
│   ├── pcl_virtual_scanner
│   ├── pcl_vlp_viewer
│   ├── pcl_voxel_grid
│   ├── pcl_voxel_grid_occlusion_estimation
│   ├── pcl_vtk2obj
│   ├── pcl_vtk2pcd
│   ├── pcl_vtk2ply
│   └── pcl_xyz2pcd
├── include
│   └── pcl-1.10
│   └── pcl
│   ├── 2d
│   │   ├── convolution.h
│   │   ├── edge.h
│   │   ├── impl
│   │   │   ├── convolution.hpp
│   │   │   ├── edge.hpp
│   │   │   ├── kernel.hpp
│   │   │   └── morphology.hpp
│   │   ├── kernel.h
│   │   └── morphology.h
│   ├── cloud_iterator.h
│   ├── common
│   │   ├── angles.h
│   │   ├── bivariate_polynomial.h
│   │   ├── boost.h
│   │   ├── centroid.h
│   │   ├── colors.h
│   │   ├── common.h
│   │   ├── common_headers.h
│   │   ├── concatenate.h
│   │   ├── copy_point.h
│   │   ├── distances.h
│   │   ├── eigen.h
│   │   ├── feature_histogram.h
│   │   ├── fft
│   │   │   ├── _kiss_fft_guts.h
│   │   │   ├── kiss_fft.h
│   │   │   └── kiss_fftr.h
│   │   ├── file_io.h
│   │   ├── gaussian.h
│   │   ├── generate.h
│   │   ├── geometry.h
│   │   ├── impl
│   │   │   ├── accumulators.hpp
│   │   │   ├── angles.hpp
│   │   │   ├── bivariate_polynomial.hpp
│   │   │   ├── centroid.hpp
│   │   │   ├── common.hpp
│   │   │   ├── copy_point.hpp
│   │   │   ├── eigen.hpp
│   │   │   ├── file_io.hpp
│   │   │   ├── gaussian.hpp
│   │   │   ├── generate.hpp
│   │   │   ├── intensity.hpp
│   │   │   ├── intersections.hpp
│   │   │   ├── io.hpp
│   │   │   ├── norms.hpp
│   │   │   ├── pca.hpp
│   │   │   ├── piecewise_linear_function.hpp
│   │   │   ├── polynomial_calculations.hpp
│   │   │   ├── projection_matrix.hpp
│   │   │   ├── random.hpp
│   │   │   ├── spring.hpp
│   │   │   ├── transformation_from_correspondences.hpp
│   │   │   ├── transforms.hpp
│   │   │   └── vector_average.hpp
│   │   ├── intensity.h
│   │   ├── intersections.h
│   │   ├── io.h
│   │   ├── norms.h
│   │   ├── pca.h
│   │   ├── piecewise_linear_function.h
│   │   ├── point_operators.h
│   │   ├── point_tests.h
│   │   ├── polynomial_calculations.h
│   │   ├── poses_from_matches.h
│   │   ├── projection_matrix.h
│   │   ├── random.h
│   │   ├── spring.h
│   │   ├── synchronizer.h
│   │   ├── time.h
│   │   ├── time_trigger.h
│   │   ├── transformation_from_correspondences.h
│   │   ├── transforms.h
│   │   ├── utils.h
│   │   └── vector_average.h
│   ├── compression
│   │   ├── color_coding.h
│   │   ├── compression_profiles.h
│   │   ├── entropy_range_coder.h
│   │   ├── libpng_wrapper.h
│   │   ├── octree_pointcloud_compression.h
│   │   ├── organized_pointcloud_conversion.h
│   │   └── point_coding.h
│   ├── console
│   │   ├── parse.h
│   │   ├── print.h
│   │   └── time.h
│   ├── conversions.h
│   ├── correspondence.h
│   ├── exceptions.h
│   ├── features
│   │   ├── 3dsc.h
│   │   ├── board.h
│   │   ├── boost.h
│   │   ├── boundary.h
│   │   ├── brisk_2d.h
│   │   ├── cppf.h
│   │   ├── crh.h
│   │   ├── cvfh.h
│   │   ├── don.h
│   │   ├── eigen.h
│   │   ├── esf.h
│   │   ├── feature.h
│   │   ├── flare.h
│   │   ├── fpfh.h
│   │   ├── fpfh_omp.h
│   │   ├── from_meshes.h
│   │   ├── gasd.h
│   │   ├── gfpfh.h
│   │   ├── grsd.h
│   │   ├── impl
│   │   │   ├── 3dsc.hpp
│   │   │   ├── board.hpp
│   │   │   ├── boundary.hpp
│   │   │   ├── brisk_2d.hpp
│   │   │   ├── cppf.hpp
│   │   │   ├── crh.hpp
│   │   │   ├── cvfh.hpp
│   │   │   ├── don.hpp
│   │   │   ├── esf.hpp
│   │   │   ├── feature.hpp
│   │   │   ├── flare.hpp
│   │   │   ├── fpfh.hpp
│   │   │   ├── fpfh_omp.hpp
│   │   │   ├── gasd.hpp
│   │   │   ├── gfpfh.hpp
│   │   │   ├── grsd.hpp
│   │   │   ├── integral_image2D.hpp
│   │   │   ├── integral_image_normal.hpp
│   │   │   ├── intensity_gradient.hpp
│   │   │   ├── intensity_spin.hpp
│   │   │   ├── linear_least_squares_normal.hpp
│   │   │   ├── moment_invariants.hpp
│   │   │   ├── moment_of_inertia_estimation.hpp
│   │   │   ├── multiscale_feature_persistence.hpp
│   │   │   ├── narf.hpp
│   │   │   ├── normal_3d.hpp
│   │   │   ├── normal_3d_omp.hpp
│   │   │   ├── normal_based_signature.hpp
│   │   │   ├── organized_edge_detection.hpp
│   │   │   ├── our_cvfh.hpp
│   │   │   ├── pfh.hpp
│   │   │   ├── pfhrgb.hpp
│   │   │   ├── ppf.hpp
│   │   │   ├── ppfrgb.hpp
│   │   │   ├── principal_curvatures.hpp
│   │   │   ├── range_image_border_extractor.hpp
│   │   │   ├── rift.hpp
│   │   │   ├── rops_estimation.hpp
│   │   │   ├── rsd.hpp
│   │   │   ├── shot.hpp
│   │   │   ├── shot_lrf.hpp
│   │   │   ├── shot_lrf_omp.hpp
│   │   │   ├── shot_omp.hpp
│   │   │   ├── spin_image.hpp
│   │   │   ├── statistical_multiscale_interest_region_extraction.hpp
│   │   │   ├── usc.hpp
│   │   │   └── vfh.hpp
│   │   ├── integral_image2D.h
│   │   ├── integral_image_normal.h
│   │   ├── intensity_gradient.h
│   │   ├── intensity_spin.h
│   │   ├── linear_least_squares_normal.h
│   │   ├── moment_invariants.h
│   │   ├── moment_of_inertia_estimation.h
│   │   ├── multiscale_feature_persistence.h
│   │   ├── narf_descriptor.h
│   │   ├── narf.h
│   │   ├── normal_3d.h
│   │   ├── normal_3d_omp.h
│   │   ├── normal_based_signature.h
│   │   ├── organized_edge_detection.h
│   │   ├── our_cvfh.h
│   │   ├── pfh.h
│   │   ├── pfhrgb.h
│   │   ├── pfh_tools.h
│   │   ├── ppf.h
│   │   ├── ppfrgb.h
│   │   ├── principal_curvatures.h
│   │   ├── range_image_border_extractor.h
│   │   ├── rift.h
│   │   ├── rops_estimation.h
│   │   ├── rsd.h
│   │   ├── shot.h
│   │   ├── shot_lrf.h
│   │   ├── shot_lrf_omp.h
│   │   ├── shot_omp.h
│   │   ├── spin_image.h
│   │   ├── statistical_multiscale_interest_region_extraction.h
│   │   ├── usc.h
│   │   └── vfh.h
│   ├── filters
│   │   ├── approximate_voxel_grid.h
│   │   ├── bilateral.h
│   │   ├── boost.h
│   │   ├── box_clipper3D.h
│   │   ├── clipper3D.h
│   │   ├── conditional_removal.h
│   │   ├── convolution_3d.h
│   │   ├── convolution.h
│   │   ├── covariance_sampling.h
│   │   ├── crop_box.h
│   │   ├── crop_hull.h
│   │   ├── extract_indices.h
│   │   ├── fast_bilateral.h
│   │   ├── fast_bilateral_omp.h
│   │   ├── filter.h
│   │   ├── filter_indices.h
│   │   ├── frustum_culling.h
│   │   ├── grid_minimum.h
│   │   ├── impl
│   │   │   ├── approximate_voxel_grid.hpp
│   │   │   ├── bilateral.hpp
│   │   │   ├── box_clipper3D.hpp
│   │   │   ├── conditional_removal.hpp
│   │   │   ├── convolution_3d.hpp
│   │   │   ├── convolution.hpp
│   │   │   ├── covariance_sampling.hpp
│   │   │   ├── crop_box.hpp
│   │   │   ├── crop_hull.hpp
│   │   │   ├── extract_indices.hpp
│   │   │   ├── fast_bilateral.hpp
│   │   │   ├── fast_bilateral_omp.hpp
│   │   │   ├── filter.hpp
│   │   │   ├── filter_indices.hpp
│   │   │   ├── frustum_culling.hpp
│   │   │   ├── grid_minimum.hpp
│   │   │   ├── local_maximum.hpp
│   │   │   ├── median_filter.hpp
│   │   │   ├── model_outlier_removal.hpp
│   │   │   ├── morphological_filter.hpp
│   │   │   ├── normal_refinement.hpp
│   │   │   ├── normal_space.hpp
│   │   │   ├── passthrough.hpp
│   │   │   ├── plane_clipper3D.hpp
│   │   │   ├── project_inliers.hpp
│   │   │   ├── radius_outlier_removal.hpp
│   │   │   ├── random_sample.hpp
│   │   │   ├── sampling_surface_normal.hpp
│   │   │   ├── shadowpoints.hpp
│   │   │   ├── statistical_outlier_removal.hpp
│   │   │   ├── uniform_sampling.hpp
│   │   │   ├── voxel_grid_covariance.hpp
│   │   │   ├── voxel_grid.hpp
│   │   │   └── voxel_grid_occlusion_estimation.hpp
│   │   ├── local_maximum.h
│   │   ├── median_filter.h
│   │   ├── model_outlier_removal.h
│   │   ├── morphological_filter.h
│   │   ├── normal_refinement.h
│   │   ├── normal_space.h
│   │   ├── passthrough.h
│   │   ├── plane_clipper3D.h
│   │   ├── project_inliers.h
│   │   ├── radius_outlier_removal.h
│   │   ├── random_sample.h
│   │   ├── sampling_surface_normal.h
│   │   ├── shadowpoints.h
│   │   ├── statistical_outlier_removal.h
│   │   ├── uniform_sampling.h
│   │   ├── voxel_grid_covariance.h
│   │   ├── voxel_grid.h
│   │   ├── voxel_grid_label.h
│   │   └── voxel_grid_occlusion_estimation.h
│   ├── for_each_type.h
│   ├── geometry
│   │   ├── boost.h
│   │   ├── eigen.h
│   │   ├── get_boundary.h
│   │   ├── impl
│   │   │   └── polygon_operations.hpp
│   │   ├── line_iterator.h
│   │   ├── mesh_base.h
│   │   ├── mesh_circulators.h
│   │   ├── mesh_conversion.h
│   │   ├── mesh_elements.h
│   │   ├── mesh_indices.h
│   │   ├── mesh_io.h
│   │   ├── mesh_traits.h
│   │   ├── organized_index_iterator.h
│   │   ├── planar_polygon.h
│   │   ├── polygon_mesh.h
│   │   ├── polygon_operations.h
│   │   ├── quad_mesh.h
│   │   └── triangle_mesh.h
│   ├── impl
│   │   ├── cloud_iterator.hpp
│   │   ├── instantiate.hpp
│   │   ├── pcl_base.hpp
│   │   └── point_types.hpp
│   ├── io
│   │   ├── ascii_io.h
│   │   ├── auto_io.h
│   │   ├── boost.h
│   │   ├── debayer.h
│   │   ├── dinast_grabber.h
│   │   ├── eigen.h
│   │   ├── file_grabber.h
│   │   ├── file_io.h
│   │   ├── fotonic_grabber.h
│   │   ├── grabber.h
│   │   ├── hdl_grabber.h
│   │   ├── ifs_io.h
│   │   ├── image_grabber.h
│   │   ├── impl
│   │   │   ├── ascii_io.hpp
│   │   │   ├── auto_io.hpp
│   │   │   ├── entropy_range_coder.hpp
│   │   │   ├── lzf_image_io.hpp
│   │   │   ├── octree_pointcloud_compression.hpp
│   │   │   ├── pcd_io.hpp
│   │   │   ├── point_cloud_image_extractors.hpp
│   │   │   ├── synchronized_queue.hpp
│   │   │   └── vtk_lib_io.hpp
│   │   ├── io_exception.h
│   │   ├── io.h
│   │   ├── low_level_io.h
│   │   ├── lzf.h
│   │   ├── lzf_image_io.h
│   │   ├── obj_io.h
│   │   ├── pcd_grabber.h
│   │   ├── pcd_io.h
│   │   ├── ply
│   │   │   ├── byte_order.h
│   │   │   ├── io_operators.h
│   │   │   ├── ply.h
│   │   │   └── ply_parser.h
│   │   ├── ply_io.h
│   │   ├── png_io.h
│   │   ├── point_cloud_image_extractors.h
│   │   ├── pxc_grabber.h
│   │   ├── robot_eye_grabber.h
│   │   ├── tar.h
│   │   ├── vlp_grabber.h
│   │   ├── vtk_io.h
│   │   └── vtk_lib_io.h
│   ├── kdtree
│   │   ├── flann.h
│   │   ├── impl
│   │   │   ├── io.hpp
│   │   │   └── kdtree_flann.hpp
│   │   ├── io.h
│   │   ├── kdtree_flann.h
│   │   └── kdtree.h
│   ├── keypoints
│   │   ├── agast_2d.h
│   │   ├── brisk_2d.h
│   │   ├── harris_2d.h
│   │   ├── harris_3d.h
│   │   ├── harris_6d.h
│   │   ├── impl
│   │   │   ├── agast_2d.hpp
│   │   │   ├── brisk_2d.hpp
│   │   │   ├── harris_2d.hpp
│   │   │   ├── harris_3d.hpp
│   │   │   ├── harris_6d.hpp
│   │   │   ├── iss_3d.hpp
│   │   │   ├── keypoint.hpp
│   │   │   ├── sift_keypoint.hpp
│   │   │   ├── smoothed_surfaces_keypoint.hpp
│   │   │   ├── susan.hpp
│   │   │   ├── trajkovic_2d.hpp
│   │   │   └── trajkovic_3d.hpp
│   │   ├── iss_3d.h
│   │   ├── keypoint.h
│   │   ├── narf_keypoint.h
│   │   ├── sift_keypoint.h
│   │   ├── smoothed_surfaces_keypoint.h
│   │   ├── susan.h
│   │   ├── trajkovic_2d.h
│   │   ├── trajkovic_3d.h
│   │   └── uniform_sampling.h
│   ├── make_shared.h
│   ├── ml
│   │   ├── branch_estimator.h
│   │   ├── densecrf.h
│   │   ├── dt
│   │   │   ├── decision_forest_evaluator.h
│   │   │   ├── decision_forest.h
│   │   │   ├── decision_forest_trainer.h
│   │   │   ├── decision_tree_data_provider.h
│   │   │   ├── decision_tree_evaluator.h
│   │   │   ├── decision_tree.h
│   │   │   └── decision_tree_trainer.h
│   │   ├── feature_handler.h
│   │   ├── ferns
│   │   │   ├── fern_evaluator.h
│   │   │   ├── fern.h
│   │   │   └── fern_trainer.h
│   │   ├── impl
│   │   │   ├── dt
│   │   │   │   ├── decision_forest_evaluator.hpp
│   │   │   │   ├── decision_forest_trainer.hpp
│   │   │   │   ├── decision_tree_evaluator.hpp
│   │   │   │   └── decision_tree_trainer.hpp
│   │   │   ├── ferns
│   │   │   │   ├── fern_evaluator.hpp
│   │   │   │   └── fern_trainer.hpp
│   │   │   └── svm
│   │   │   └── svm_wrapper.hpp
│   │   ├── kmeans.h
│   │   ├── multi_channel_2d_comparison_feature.h
│   │   ├── multi_channel_2d_comparison_feature_handler.h
│   │   ├── multi_channel_2d_data_set.h
│   │   ├── multiple_data_2d_example_index.h
│   │   ├── pairwise_potential.h
│   │   ├── permutohedral.h
│   │   ├── point_xy_32f.h
│   │   ├── point_xy_32i.h
│   │   ├── regression_variance_stats_estimator.h
│   │   ├── stats_estimator.h
│   │   ├── svm.h
│   │   └── svm_wrapper.h
│   ├── ModelCoefficients.h
│   ├── octree
│   │   ├── boost.h
│   │   ├── impl
│   │   │   ├── octree2buf_base.hpp
│   │   │   ├── octree_base.hpp
│   │   │   ├── octree_iterator.hpp
│   │   │   ├── octree_pointcloud_adjacency.hpp
│   │   │   ├── octree_pointcloud.hpp
│   │   │   ├── octree_pointcloud_voxelcentroid.hpp
│   │   │   └── octree_search.hpp
│   │   ├── octree2buf_base.h
│   │   ├── octree_base.h
│   │   ├── octree_container.h
│   │   ├── octree.h
│   │   ├── octree_impl.h
│   │   ├── octree_iterator.h
│   │   ├── octree_key.h
│   │   ├── octree_nodes.h
│   │   ├── octree_pointcloud_adjacency_container.h
│   │   ├── octree_pointcloud_adjacency.h
│   │   ├── octree_pointcloud_changedetector.h
│   │   ├── octree_pointcloud_density.h
│   │   ├── octree_pointcloud.h
│   │   ├── octree_pointcloud_occupancy.h
│   │   ├── octree_pointcloud_pointvector.h
│   │   ├── octree_pointcloud_singlepoint.h
│   │   ├── octree_pointcloud_voxelcentroid.h
│   │   └── octree_search.h
│   ├── outofcore
│   │   ├── boost.h
│   │   ├── cJSON.h
│   │   ├── impl
│   │   │   ├── lru_cache.hpp
│   │   │   ├── monitor_queue.hpp
│   │   │   ├── octree_base.hpp
│   │   │   ├── octree_base_node.hpp
│   │   │   ├── octree_disk_container.hpp
│   │   │   ├── octree_ram_container.hpp
│   │   │   ├── outofcore_breadth_first_iterator.hpp
│   │   │   └── outofcore_depth_first_iterator.hpp
│   │   ├── metadata.h
│   │   ├── octree_abstract_node_container.h
│   │   ├── octree_base.h
│   │   ├── octree_base_node.h
│   │   ├── octree_disk_container.h
│   │   ├── octree_ram_container.h
│   │   ├── outofcore_base_data.h
│   │   ├── outofcore_breadth_first_iterator.h
│   │   ├── outofcore_depth_first_iterator.h
│   │   ├── outofcore.h
│   │   ├── outofcore_impl.h
│   │   ├── outofcore_iterator_base.h
│   │   ├── outofcore_node_data.h
│   │   └── visualization
│   │   ├── axes.h
│   │   ├── camera.h
│   │   ├── common.h
│   │   ├── geometry.h
│   │   ├── grid.h
│   │   ├── object.h
│   │   ├── outofcore_cloud.h
│   │   ├── scene.h
│   │   └── viewport.h
│   ├── pcl_base.h
│   ├── pcl_config.h
│   ├── pcl_exports.h
│   ├── PCLHeader.h
│   ├── PCLImage.h
│   ├── pcl_macros.h
│   ├── PCLPointCloud2.h
│   ├── PCLPointField.h
│   ├── pcl_tests.h
│   ├── people
│   │   ├── ground_based_people_detection_app.h
│   │   ├── head_based_subcluster.h
│   │   ├── height_map_2d.h
│   │   ├── hog.h
│   │   ├── impl
│   │   │   ├── ground_based_people_detection_app.hpp
│   │   │   ├── head_based_subcluster.hpp
│   │   │   ├── height_map_2d.hpp
│   │   │   ├── person_classifier.hpp
│   │   │   └── person_cluster.hpp
│   │   ├── person_classifier.h
│   │   └── person_cluster.h
│   ├── point_cloud.h
│   ├── PointIndices.h
│   ├── point_representation.h
│   ├── point_traits.h
│   ├── point_types_conversion.h
│   ├── point_types.h
│   ├── PolygonMesh.h
│   ├── range_image
│   │   ├── bearing_angle_image.h
│   │   ├── impl
│   │   │   ├── range_image.hpp
│   │   │   ├── range_image_planar.hpp
│   │   │   └── range_image_spherical.hpp
│   │   ├── range_image.h
│   │   ├── range_image_planar.h
│   │   └── range_image_spherical.h
│   ├── recognition
│   │   ├── 3rdparty
│   │   │   └── metslib
│   │   │   ├── abstract-search.hh
│   │   │   ├── local-search.hh
│   │   │   ├── mets.hh
│   │   │   ├── metslib_config.hh
│   │   │   ├── model.hh
│   │   │   ├── observer.hh
│   │   │   ├── simulated-annealing.hh
│   │   │   ├── tabu-search.hh
│   │   │   └── termination-criteria.hh
│   │   ├── auxiliary.h
│   │   ├── boost.h
│   │   ├── bvh.h
│   │   ├── cg
│   │   │   ├── correspondence_grouping.h
│   │   │   ├── geometric_consistency.h
│   │   │   └── hough_3d.h
│   │   ├── color_gradient_dot_modality.h
│   │   ├── color_gradient_modality.h
│   │   ├── color_modality.h
│   │   ├── crh_alignment.h
│   │   ├── dense_quantized_multi_mod_template.h
│   │   ├── distance_map.h
│   │   ├── dot_modality.h
│   │   ├── dotmod.h
│   │   ├── face_detection
│   │   │   ├── face_common.h
│   │   │   ├── face_detector_data_provider.h
│   │   │   ├── rf_face_detector_trainer.h
│   │   │   └── rf_face_utils.h
│   │   ├── hv
│   │   │   ├── greedy_verification.h
│   │   │   ├── hv_go.h
│   │   │   ├── hv_papazov.h
│   │   │   ├── hypotheses_verification.h
│   │   │   └── occlusion_reasoning.h
│   │   ├── hypothesis.h
│   │   ├── impl
│   │   │   ├── cg
│   │   │   │   ├── correspondence_grouping.hpp
│   │   │   │   ├── geometric_consistency.hpp
│   │   │   │   └── hough_3d.hpp
│   │   │   ├── hv
│   │   │   │   ├── greedy_verification.hpp
│   │   │   │   ├── hv_go.hpp
│   │   │   │   ├── hv_papazov.hpp
│   │   │   │   └── occlusion_reasoning.hpp
│   │   │   ├── implicit_shape_model.hpp
│   │   │   ├── linemod
│   │   │   │   └── line_rgbd.hpp
│   │   │   ├── line_rgbd.hpp
│   │   │   ├── ransac_based
│   │   │   │   ├── simple_octree.hpp
│   │   │   │   └── voxel_structure.hpp
│   │   │   ├── simple_octree.hpp
│   │   │   └── voxel_structure.hpp
│   │   ├── implicit_shape_model.h
│   │   ├── linemod
│   │   │   └── line_rgbd.h
│   │   ├── linemod.h
│   │   ├── line_rgbd.h
│   │   ├── mask_map.h
│   │   ├── model_library.h
│   │   ├── obj_rec_ransac.h
│   │   ├── orr_graph.h
│   │   ├── orr_octree.h
│   │   ├── orr_octree_zprojection.h
│   │   ├── point_types.h
│   │   ├── quantizable_modality.h
│   │   ├── quantized_map.h
│   │   ├── ransac_based
│   │   │   ├── auxiliary.h
│   │   │   ├── bvh.h
│   │   │   ├── hypothesis.h
│   │   │   ├── model_library.h
│   │   │   ├── obj_rec_ransac.h
│   │   │   ├── orr_graph.h
│   │   │   ├── orr_octree.h
│   │   │   ├── orr_octree_zprojection.h
│   │   │   ├── rigid_transform_space.h
│   │   │   ├── simple_octree.h
│   │   │   ├── trimmed_icp.h
│   │   │   └── voxel_structure.h
│   │   ├── region_xy.h
│   │   ├── rigid_transform_space.h
│   │   ├── simple_octree.h
│   │   ├── sparse_quantized_multi_mod_template.h
│   │   ├── surface_normal_modality.h
│   │   ├── trimmed_icp.h
│   │   └── voxel_structure.h
│   ├── register_point_struct.h
│   ├── registration
│   │   ├── bfgs.h
│   │   ├── boost_graph.h
│   │   ├── boost.h
│   │   ├── convergence_criteria.h
│   │   ├── correspondence_estimation_backprojection.h
│   │   ├── correspondence_estimation.h
│   │   ├── correspondence_estimation_normal_shooting.h
│   │   ├── correspondence_estimation_organized_projection.h
│   │   ├── correspondence_rejection_distance.h
│   │   ├── correspondence_rejection_features.h
│   │   ├── correspondence_rejection.h
│   │   ├── correspondence_rejection_median_distance.h
│   │   ├── correspondence_rejection_one_to_one.h
│   │   ├── correspondence_rejection_organized_boundary.h
│   │   ├── correspondence_rejection_poly.h
│   │   ├── correspondence_rejection_sample_consensus_2d.h
│   │   ├── correspondence_rejection_sample_consensus.h
│   │   ├── correspondence_rejection_surface_normal.h
│   │   ├── correspondence_rejection_trimmed.h
│   │   ├── correspondence_rejection_var_trimmed.h
│   │   ├── correspondence_sorting.h
│   │   ├── correspondence_types.h
│   │   ├── default_convergence_criteria.h
│   │   ├── distances.h
│   │   ├── eigen.h
│   │   ├── elch.h
│   │   ├── exceptions.h
│   │   ├── gicp6d.h
│   │   ├── gicp.h
│   │   ├── ia_fpcs.h
│   │   ├── ia_kfpcs.h
│   │   ├── ia_ransac.h
│   │   ├── icp.h
│   │   ├── icp_nl.h
│   │   ├── impl
│   │   │   ├── correspondence_estimation_backprojection.hpp
│   │   │   ├── correspondence_estimation.hpp
│   │   │   ├── correspondence_estimation_normal_shooting.hpp
│   │   │   ├── correspondence_estimation_organized_projection.hpp
│   │   │   ├── correspondence_rejection_distance.hpp
│   │   │   ├── correspondence_rejection_features.hpp
│   │   │   ├── correspondence_rejection_median_distance.hpp
│   │   │   ├── correspondence_rejection_one_to_one.hpp
│   │   │   ├── correspondence_rejection_organized_boundary.hpp
│   │   │   ├── correspondence_rejection_poly.hpp
│   │   │   ├── correspondence_rejection_sample_consensus_2d.hpp
│   │   │   ├── correspondence_rejection_sample_consensus.hpp
│   │   │   ├── correspondence_rejection_surface_normal.hpp
│   │   │   ├── correspondence_rejection_trimmed.hpp
│   │   │   ├── correspondence_rejection_var_trimmed.hpp
│   │   │   ├── correspondence_types.hpp
│   │   │   ├── default_convergence_criteria.hpp
│   │   │   ├── elch.hpp
│   │   │   ├── gicp.hpp
│   │   │   ├── ia_fpcs.hpp
│   │   │   ├── ia_kfpcs.hpp
│   │   │   ├── ia_ransac.hpp
│   │   │   ├── icp.hpp
│   │   │   ├── icp_nl.hpp
│   │   │   ├── incremental_registration.hpp
│   │   │   ├── joint_icp.hpp
│   │   │   ├── lum.hpp
│   │   │   ├── meta_registration.hpp
│   │   │   ├── ndt_2d.hpp
│   │   │   ├── ndt.hpp
│   │   │   ├── ppf_registration.hpp
│   │   │   ├── pyramid_feature_matching.hpp
│   │   │   ├── registration.hpp
│   │   │   ├── sample_consensus_prerejective.hpp
│   │   │   ├── transformation_estimation_2D.hpp
│   │   │   ├── transformation_estimation_3point.hpp
│   │   │   ├── transformation_estimation_dual_quaternion.hpp
│   │   │   ├── transformation_estimation_lm.hpp
│   │   │   ├── transformation_estimation_point_to_plane_lls.hpp
│   │   │   ├── transformation_estimation_point_to_plane_lls_weighted.hpp
│   │   │   ├── transformation_estimation_point_to_plane_weighted.hpp
│   │   │   ├── transformation_estimation_svd.hpp
│   │   │   ├── transformation_estimation_svd_scale.hpp
│   │   │   ├── transformation_estimation_symmetric_point_to_plane_lls.hpp
│   │   │   └── transformation_validation_euclidean.hpp
│   │   ├── incremental_registration.h
│   │   ├── joint_icp.h
│   │   ├── lum.h
│   │   ├── matching_candidate.h
│   │   ├── meta_registration.h
│   │   ├── ndt_2d.h
│   │   ├── ndt.h
│   │   ├── pairwise_graph_registration.hpp
│   │   ├── ppf_registration.h
│   │   ├── pyramid_feature_matching.h
│   │   ├── registration.h
│   │   ├── sample_consensus_prerejective.h
│   │   ├── transformation_estimation_2D.h
│   │   ├── transformation_estimation_3point.h
│   │   ├── transformation_estimation_dual_quaternion.h
│   │   ├── transformation_estimation.h
│   │   ├── transformation_estimation_lm.h
│   │   ├── transformation_estimation_point_to_plane.h
│   │   ├── transformation_estimation_point_to_plane_lls.h
│   │   ├── transformation_estimation_point_to_plane_lls_weighted.h
│   │   ├── transformation_estimation_point_to_plane_weighted.h
│   │   ├── transformation_estimation_svd.h
│   │   ├── transformation_estimation_svd_scale.h
│   │   ├── transformation_estimation_symmetric_point_to_plane_lls.h
│   │   ├── transformation_validation_euclidean.h
│   │   ├── transformation_validation.h
│   │   ├── transforms.h
│   │   ├── warp_point_rigid_3d.h
│   │   ├── warp_point_rigid_6d.h
│   │   └── warp_point_rigid.h
│   ├── sample_consensus
│   │   ├── boost.h
│   │   ├── eigen.h
│   │   ├── impl
│   │   │   ├── lmeds.hpp
│   │   │   ├── mlesac.hpp
│   │   │   ├── msac.hpp
│   │   │   ├── prosac.hpp
│   │   │   ├── ransac.hpp
│   │   │   ├── rmsac.hpp
│   │   │   ├── rransac.hpp
│   │   │   ├── sac_model_circle3d.hpp
│   │   │   ├── sac_model_circle.hpp
│   │   │   ├── sac_model_cone.hpp
│   │   │   ├── sac_model_cylinder.hpp
│   │   │   ├── sac_model_line.hpp
│   │   │   ├── sac_model_normal_parallel_plane.hpp
│   │   │   ├── sac_model_normal_plane.hpp
│   │   │   ├── sac_model_normal_sphere.hpp
│   │   │   ├── sac_model_parallel_line.hpp
│   │   │   ├── sac_model_parallel_plane.hpp
│   │   │   ├── sac_model_perpendicular_plane.hpp
│   │   │   ├── sac_model_plane.hpp
│   │   │   ├── sac_model_registration_2d.hpp
│   │   │   ├── sac_model_registration.hpp
│   │   │   ├── sac_model_sphere.hpp
│   │   │   └── sac_model_stick.hpp
│   │   ├── lmeds.h
│   │   ├── method_types.h
│   │   ├── mlesac.h
│   │   ├── model_types.h
│   │   ├── msac.h
│   │   ├── prosac.h
│   │   ├── ransac.h
│   │   ├── rmsac.h
│   │   ├── rransac.h
│   │   ├── sac.h
│   │   ├── sac_model_circle3d.h
│   │   ├── sac_model_circle.h
│   │   ├── sac_model_cone.h
│   │   ├── sac_model_cylinder.h
│   │   ├── sac_model.h
│   │   ├── sac_model_line.h
│   │   ├── sac_model_normal_parallel_plane.h
│   │   ├── sac_model_normal_plane.h
│   │   ├── sac_model_normal_sphere.h
│   │   ├── sac_model_parallel_line.h
│   │   ├── sac_model_parallel_plane.h
│   │   ├── sac_model_perpendicular_plane.h
│   │   ├── sac_model_plane.h
│   │   ├── sac_model_registration_2d.h
│   │   ├── sac_model_registration.h
│   │   ├── sac_model_sphere.h
│   │   └── sac_model_stick.h
│   ├── search
│   │   ├── brute_force.h
│   │   ├── flann_search.h
│   │   ├── impl
│   │   │   ├── brute_force.hpp
│   │   │   ├── flann_search.hpp
│   │   │   ├── kdtree.hpp
│   │   │   ├── organized.hpp
│   │   │   └── search.hpp
│   │   ├── kdtree.h
│   │   ├── octree.h
│   │   ├── organized.h
│   │   ├── pcl_search.h
│   │   └── search.h
│   ├── segmentation
│   │   ├── approximate_progressive_morphological_filter.h
│   │   ├── boost.h
│   │   ├── comparator.h
│   │   ├── conditional_euclidean_clustering.h
│   │   ├── cpc_segmentation.h
│   │   ├── crf_normal_segmentation.h
│   │   ├── crf_segmentation.h
│   │   ├── edge_aware_plane_comparator.h
│   │   ├── euclidean_cluster_comparator.h
│   │   ├── euclidean_plane_coefficient_comparator.h
│   │   ├── extract_clusters.h
│   │   ├── extract_labeled_clusters.h
│   │   ├── extract_polygonal_prism_data.h
│   │   ├── grabcut_segmentation.h
│   │   ├── ground_plane_comparator.h
│   │   ├── impl
│   │   │   ├── approximate_progressive_morphological_filter.hpp
│   │   │   ├── conditional_euclidean_clustering.hpp
│   │   │   ├── cpc_segmentation.hpp
│   │   │   ├── crf_normal_segmentation.hpp
│   │   │   ├── crf_segmentation.hpp
│   │   │   ├── extract_clusters.hpp
│   │   │   ├── extract_labeled_clusters.hpp
│   │   │   ├── extract_polygonal_prism_data.hpp
│   │   │   ├── grabcut_segmentation.hpp
│   │   │   ├── lccp_segmentation.hpp
│   │   │   ├── min_cut_segmentation.hpp
│   │   │   ├── organized_connected_component_segmentation.hpp
│   │   │   ├── organized_multi_plane_segmentation.hpp
│   │   │   ├── planar_polygon_fusion.hpp
│   │   │   ├── progressive_morphological_filter.hpp
│   │   │   ├── random_walker.hpp
│   │   │   ├── region_growing.hpp
│   │   │   ├── region_growing_rgb.hpp
│   │   │   ├── sac_segmentation.hpp
│   │   │   ├── seeded_hue_segmentation.hpp
│   │   │   ├── segment_differences.hpp
│   │   │   ├── supervoxel_clustering.hpp
│   │   │   └── unary_classifier.hpp
│   │   ├── lccp_segmentation.h
│   │   ├── min_cut_segmentation.h
│   │   ├── organized_connected_component_segmentation.h
│   │   ├── organized_multi_plane_segmentation.h
│   │   ├── planar_polygon_fusion.h
│   │   ├── planar_region.h
│   │   ├── plane_coefficient_comparator.h
│   │   ├── plane_refinement_comparator.h
│   │   ├── progressive_morphological_filter.h
│   │   ├── random_walker.h
│   │   ├── region_3d.h
│   │   ├── region_growing.h
│   │   ├── region_growing_rgb.h
│   │   ├── rgb_plane_coefficient_comparator.h
│   │   ├── sac_segmentation.h
│   │   ├── seeded_hue_segmentation.h
│   │   ├── segment_differences.h
│   │   ├── supervoxel_clustering.h
│   │   └── unary_classifier.h
│   ├── sse.h
│   ├── stereo
│   │   ├── digital_elevation_map.h
│   │   ├── disparity_map_converter.h
│   │   ├── impl
│   │   │   └── disparity_map_converter.hpp
│   │   ├── stereo_grabber.h
│   │   └── stereo_matching.h
│   ├── surface
│   │   ├── 3rdparty
│   │   │   └── poisson4
│   │   │   ├── allocator.h
│   │   │   ├── binary_node.h
│   │   │   ├── bspline_data.h
│   │   │   ├── bspline_data.hpp
│   │   │   ├── factor.h
│   │   │   ├── function_data.h
│   │   │   ├── function_data.hpp
│   │   │   ├── geometry.h
│   │   │   ├── geometry.hpp
│   │   │   ├── marching_cubes_poisson.h
│   │   │   ├── mat.h
│   │   │   ├── mat.hpp
│   │   │   ├── multi_grid_octree_data.h
│   │   │   ├── multi_grid_octree_data.hpp
│   │   │   ├── octree_poisson.h
│   │   │   ├── octree_poisson.hpp
│   │   │   ├── poisson_exceptions.h
│   │   │   ├── polynomial.h
│   │   │   ├── polynomial.hpp
│   │   │   ├── ppolynomial.h
│   │   │   ├── ppolynomial.hpp
│   │   │   ├── sparse_matrix.h
│   │   │   ├── sparse_matrix.hpp
│   │   │   ├── vector.h
│   │   │   └── vector.hpp
│   │   ├── bilateral_upsampling.h
│   │   ├── boost.h
│   │   ├── concave_hull.h
│   │   ├── convex_hull.h
│   │   ├── ear_clipping.h
│   │   ├── eigen.h
│   │   ├── gp3.h
│   │   ├── grid_projection.h
│   │   ├── impl
│   │   │   ├── bilateral_upsampling.hpp
│   │   │   ├── concave_hull.hpp
│   │   │   ├── convex_hull.hpp
│   │   │   ├── gp3.hpp
│   │   │   ├── grid_projection.hpp
│   │   │   ├── marching_cubes_hoppe.hpp
│   │   │   ├── marching_cubes.hpp
│   │   │   ├── marching_cubes_rbf.hpp
│   │   │   ├── mls.hpp
│   │   │   ├── organized_fast_mesh.hpp
│   │   │   ├── poisson.hpp
│   │   │   ├── processing.hpp
│   │   │   ├── reconstruction.hpp
│   │   │   ├── surfel_smoothing.hpp
│   │   │   └── texture_mapping.hpp
│   │   ├── marching_cubes.h
│   │   ├── marching_cubes_hoppe.h
│   │   ├── marching_cubes_rbf.h
│   │   ├── mls.h
│   │   ├── organized_fast_mesh.h
│   │   ├── poisson.h
│   │   ├── processing.h
│   │   ├── qhull.h
│   │   ├── reconstruction.h
│   │   ├── simplification_remove_unused_vertices.h
│   │   ├── surfel_smoothing.h
│   │   ├── texture_mapping.h
│   │   └── vtk_smoothing
│   │   ├── vtk.h
│   │   ├── vtk_mesh_quadric_decimation.h
│   │   ├── vtk_mesh_smoothing_laplacian.h
│   │   ├── vtk_mesh_smoothing_windowed_sinc.h
│   │   ├── vtk_mesh_subdivision.h
│   │   └── vtk_utils.h
│   ├── TextureMesh.h
│   ├── tracking
│   │   ├── approx_nearest_pair_point_cloud_coherence.h
│   │   ├── coherence.h
│   │   ├── distance_coherence.h
│   │   ├── hsv_color_coherence.h
│   │   ├── impl
│   │   │   ├── approx_nearest_pair_point_cloud_coherence.hpp
│   │   │   ├── coherence.hpp
│   │   │   ├── distance_coherence.hpp
│   │   │   ├── hsv_color_coherence.hpp
│   │   │   ├── kld_adaptive_particle_filter.hpp
│   │   │   ├── kld_adaptive_particle_filter_omp.hpp
│   │   │   ├── nearest_pair_point_cloud_coherence.hpp
│   │   │   ├── normal_coherence.hpp
│   │   │   ├── particle_filter.hpp
│   │   │   ├── particle_filter_omp.hpp
│   │   │   ├── pyramidal_klt.hpp
│   │   │   ├── tracker.hpp
│   │   │   └── tracking.hpp
│   │   ├── kld_adaptive_particle_filter.h
│   │   ├── kld_adaptive_particle_filter_omp.h
│   │   ├── nearest_pair_point_cloud_coherence.h
│   │   ├── normal_coherence.h
│   │   ├── particle_filter.h
│   │   ├── particle_filter_omp.h
│   │   ├── pyramidal_klt.h
│   │   ├── tracker.h
│   │   └── tracking.h
│   ├── Vertices.h
│   └── visualization
│   ├── area_picking_event.h
│   ├── boost.h
│   ├── cloud_viewer.h
│   ├── common
│   │   ├── actor_map.h
│   │   ├── common.h
│   │   ├── float_image_utils.h
│   │   ├── impl
│   │   │   ├── common.hpp
│   │   │   └── shapes.hpp
│   │   ├── io.h
│   │   ├── ren_win_interact_map.h
│   │   └── shapes.h
│   ├── eigen.h
│   ├── histogram_visualizer.h
│   ├── image_viewer.h
│   ├── impl
│   │   ├── histogram_visualizer.hpp
│   │   ├── image_viewer.hpp
│   │   ├── pcl_plotter.hpp
│   │   ├── pcl_visualizer.hpp
│   │   ├── point_cloud_color_handlers.hpp
│   │   ├── point_cloud_geometry_handlers.hpp
│   │   ├── point_cloud_handlers.hpp
│   │   └── registration_visualizer.hpp
│   ├── interactor_style.h
│   ├── keyboard_event.h
│   ├── mouse_event.h
│   ├── pcl_painter2D.h
│   ├── pcl_plotter.h
│   ├── pcl_visualizer.h
│   ├── point_cloud_color_handlers.h
│   ├── point_cloud_geometry_handlers.h
│   ├── point_cloud_handlers.h
│   ├── point_picking_event.h
│   ├── range_image_visualizer.h
│   ├── registration_visualizer.h
│   ├── simple_buffer_visualizer.h
│   ├── vtk
│   │   ├── pcl_context_item.h
│   │   ├── pcl_image_canvas_source_2d.h
│   │   └── vtkRenderWindowInteractorFix.h
│   ├── vtk.h
│   └── window.h
├── lib
│   ├── libpcl_common.so -> libpcl_common.so.1.10
│   ├── libpcl_common.so.1.10 -> libpcl_common.so.1.10.1
│   ├── libpcl_common.so.1.10.1
│   ├── libpcl_features.so -> libpcl_features.so.1.10
│   ├── libpcl_features.so.1.10 -> libpcl_features.so.1.10.1
│   ├── libpcl_features.so.1.10.1
│   ├── libpcl_filters.so -> libpcl_filters.so.1.10
│   ├── libpcl_filters.so.1.10 -> libpcl_filters.so.1.10.1
│   ├── libpcl_filters.so.1.10.1
│   ├── libpcl_io_ply.so -> libpcl_io_ply.so.1.10
│   ├── libpcl_io_ply.so.1.10 -> libpcl_io_ply.so.1.10.1
│   ├── libpcl_io_ply.so.1.10.1
│   ├── libpcl_io.so -> libpcl_io.so.1.10
│   ├── libpcl_io.so.1.10 -> libpcl_io.so.1.10.1
│   ├── libpcl_io.so.1.10.1
│   ├── libpcl_kdtree.so -> libpcl_kdtree.so.1.10
│   ├── libpcl_kdtree.so.1.10 -> libpcl_kdtree.so.1.10.1
│   ├── libpcl_kdtree.so.1.10.1
│   ├── libpcl_keypoints.so -> libpcl_keypoints.so.1.10
│   ├── libpcl_keypoints.so.1.10 -> libpcl_keypoints.so.1.10.1
│   ├── libpcl_keypoints.so.1.10.1
│   ├── libpcl_ml.so -> libpcl_ml.so.1.10
│   ├── libpcl_ml.so.1.10 -> libpcl_ml.so.1.10.1
│   ├── libpcl_ml.so.1.10.1
│   ├── libpcl_octree.so -> libpcl_octree.so.1.10
│   ├── libpcl_octree.so.1.10 -> libpcl_octree.so.1.10.1
│   ├── libpcl_octree.so.1.10.1
│   ├── libpcl_outofcore.so -> libpcl_outofcore.so.1.10
│   ├── libpcl_outofcore.so.1.10 -> libpcl_outofcore.so.1.10.1
│   ├── libpcl_outofcore.so.1.10.1
│   ├── libpcl_people.so -> libpcl_people.so.1.10
│   ├── libpcl_people.so.1.10 -> libpcl_people.so.1.10.1
│   ├── libpcl_people.so.1.10.1
│   ├── libpcl_recognition.so -> libpcl_recognition.so.1.10
│   ├── libpcl_recognition.so.1.10 -> libpcl_recognition.so.1.10.1
│   ├── libpcl_recognition.so.1.10.1
│   ├── libpcl_registration.so -> libpcl_registration.so.1.10
│   ├── libpcl_registration.so.1.10 -> libpcl_registration.so.1.10.1
│   ├── libpcl_registration.so.1.10.1
│   ├── libpcl_sample_consensus.so -> libpcl_sample_consensus.so.1.10
│   ├── libpcl_sample_consensus.so.1.10 -> libpcl_sample_consensus.so.1.10.1
│   ├── libpcl_sample_consensus.so.1.10.1
│   ├── libpcl_search.so -> libpcl_search.so.1.10
│   ├── libpcl_search.so.1.10 -> libpcl_search.so.1.10.1
│   ├── libpcl_search.so.1.10.1
│   ├── libpcl_segmentation.so -> libpcl_segmentation.so.1.10
│   ├── libpcl_segmentation.so.1.10 -> libpcl_segmentation.so.1.10.1
│   ├── libpcl_segmentation.so.1.10.1
│   ├── libpcl_stereo.so -> libpcl_stereo.so.1.10
│   ├── libpcl_stereo.so.1.10 -> libpcl_stereo.so.1.10.1
│   ├── libpcl_stereo.so.1.10.1
│   ├── libpcl_surface.so -> libpcl_surface.so.1.10
│   ├── libpcl_surface.so.1.10 -> libpcl_surface.so.1.10.1
│   ├── libpcl_surface.so.1.10.1
│   ├── libpcl_tracking.so -> libpcl_tracking.so.1.10
│   ├── libpcl_tracking.so.1.10 -> libpcl_tracking.so.1.10.1
│   ├── libpcl_tracking.so.1.10.1
│   ├── libpcl_visualization.so -> libpcl_visualization.so.1.10
│   ├── libpcl_visualization.so.1.10 -> libpcl_visualization.so.1.10.1
│   ├── libpcl_visualization.so.1.10.1
│   └── pkgconfig
│   ├── pcl_2d-1.10.pc
│   ├── pcl_common-1.10.pc
│   ├── pcl_features-1.10.pc
│   ├── pcl_filters-1.10.pc
│   ├── pcl_geometry-1.10.pc
│   ├── pcl_io-1.10.pc
│   ├── pcl_kdtree-1.10.pc
│   ├── pcl_keypoints-1.10.pc
│   ├── pcl_ml-1.10.pc
│   ├── pcl_octree-1.10.pc
│   ├── pcl_outofcore-1.10.pc
│   ├── pcl_people-1.10.pc
│   ├── pcl_recognition-1.10.pc
│   ├── pcl_registration-1.10.pc
│   ├── pcl_sample_consensus-1.10.pc
│   ├── pcl_search-1.10.pc
│   ├── pcl_segmentation-1.10.pc
│   ├── pcl_stereo-1.10.pc
│   ├── pcl_surface-1.10.pc
│   ├── pcl_tracking-1.10.pc
│   └── pcl_visualization-1.10.pc
└── share
└── pcl-1.10
├── Modules
│   ├── FindClangFormat.cmake
│   ├── FinddavidSDK.cmake
│   ├── FindDSSDK.cmake
│   ├── FindEigen.cmake
│   ├── FindEnsenso.cmake
│   ├── FindFLANN.cmake
│   ├── Findlibusb-1.0.cmake
│   ├── FindOpenNI2.cmake
│   ├── FindOpenNI.cmake
│   ├── FindPcap.cmake
│   ├── FindQhull.cmake
│   ├── FindRSSDK2.cmake
│   ├── FindRSSDK.cmake
│   ├── FindSphinx.cmake
│   └── UseCompilerCache.cmake
├── PCLConfig.cmake
└── PCLConfigVersion.cmake
81 directories, 1119 files
Sign up for free to join this conversation on GitHub. Already have an account? Sign in to comment