实例介绍
【实例截图】
【核心代码】
.
├── PCL V1.8.1 VS2015静态编译库.rar
├── bin
│ ├── concrt140.dll
│ ├── msvcp140.dll
│ ├── pcl_add_gaussian_noise_release.exe
│ ├── pcl_boundary_estimation_release.exe
│ ├── pcl_cluster_extraction_release.exe
│ ├── pcl_compute_cloud_error_release.exe
│ ├── pcl_compute_hausdorff_release.exe
│ ├── pcl_concatenate_points_pcd_release.exe
│ ├── pcl_convert_pcd_ascii_binary_release.exe
│ ├── pcl_crf_segmentation_release.exe
│ ├── pcl_demean_cloud_release.exe
│ ├── pcl_elch_release.exe
│ ├── pcl_extract_feature_release.exe
│ ├── pcl_fast_bilateral_filter_release.exe
│ ├── pcl_fpfh_estimation_release.exe
│ ├── pcl_generate_release.exe
│ ├── pcl_gp3_surface_release.exe
│ ├── pcl_grid_min_release.exe
│ ├── pcl_hdl_grabber_release.exe
│ ├── pcl_icp2d_release.exe
│ ├── pcl_icp_release.exe
│ ├── pcl_linemod_detection_release.exe
│ ├── pcl_local_max_release.exe
│ ├── pcl_lum_release.exe
│ ├── pcl_marching_cubes_reconstruction_release.exe
│ ├── pcl_match_linemod_template_release.exe
│ ├── pcl_mls_smoothing_release.exe
│ ├── pcl_morph_release.exe
│ ├── pcl_ndt2d_release.exe
│ ├── pcl_ndt3d_release.exe
│ ├── pcl_normal_estimation_release.exe
│ ├── pcl_outlier_removal_release.exe
│ ├── pcl_passthrough_filter_release.exe
│ ├── pcl_pcd2ply_release.exe
│ ├── pcl_pcd2vtk_release.exe
│ ├── pcl_pcd_change_viewpoint_release.exe
│ ├── pcl_pcd_convert_NaN_nan_release.exe
│ ├── pcl_pcd_introduce_nan_release.exe
│ ├── pcl_pclzf2pcd_release.exe
│ ├── pcl_plane_projection_release.exe
│ ├── pcl_ply2obj_release.exe
│ ├── pcl_ply2pcd_release.exe
│ ├── pcl_ply2ply_release.exe
│ ├── pcl_ply2raw_release.exe
│ ├── pcl_plyheader_release.exe
│ ├── pcl_poisson_reconstruction_release.exe
│ ├── pcl_progressive_morphological_filter_release.exe
│ ├── pcl_radius_filter_release.exe
│ ├── pcl_sac_segmentation_plane_release.exe
│ ├── pcl_spin_estimation_release.exe
│ ├── pcl_train_linemod_template_release.exe
│ ├── pcl_train_unary_classifier_release.exe
│ ├── pcl_transform_from_viewpoint_release.exe
│ ├── pcl_transform_point_cloud_release.exe
│ ├── pcl_unary_classifier_segment_release.exe
│ ├── pcl_uniform_sampling_release.exe
│ ├── pcl_vfh_estimation_release.exe
│ ├── pcl_voxel_grid_release.exe
│ ├── pcl_xyz2pcd_release.exe
│ └── vcruntime140.dll
├── cmake
│ ├── PCLConfig.cmake
│ └── PCLConfigVersion.cmake
├── include
│ └── pcl-1.8
│ └── pcl
│ ├── 2d
│ │ ├── convolution.h
│ │ ├── edge.h
│ │ ├── impl
│ │ │ ├── convolution.hpp
│ │ │ ├── edge.hpp
│ │ │ └── morphology.hpp
│ │ ├── kernel.h
│ │ └── morphology.h
│ ├── ModelCoefficients.h
│ ├── PCLHeader.h
│ ├── PCLImage.h
│ ├── PCLPointCloud2.h
│ ├── PCLPointField.h
│ ├── PointIndices.h
│ ├── PolygonMesh.h
│ ├── TextureMesh.h
│ ├── Vertices.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
│ │ ├── fpfh.h
│ │ ├── fpfh_omp.h
│ │ ├── from_meshes.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
│ │ │ ├── fpfh.hpp
│ │ │ ├── fpfh_omp.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.h
│ │ ├── narf_descriptor.h
│ │ ├── normal_3d.h
│ │ ├── normal_3d_omp.h
│ │ ├── normal_based_signature.h
│ │ ├── organized_edge_detection.h
│ │ ├── our_cvfh.h
│ │ ├── pfh.h
│ │ ├── pfh_tools.h
│ │ ├── pfhrgb.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.h
│ │ ├── convolution_3d.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.hpp
│ │ │ ├── convolution_3d.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.hpp
│ │ │ ├── voxel_grid_covariance.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.h
│ │ ├── voxel_grid_covariance.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
│ │ ├── eigen.h
│ │ ├── file_grabber.h
│ │ ├── file_io.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
│ │ ├── io.h
│ │ ├── io_exception.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
│ │ ├── point_cloud_image_extractors.h
│ │ ├── pxc_grabber.h
│ │ ├── robot_eye_grabber.h
│ │ ├── tar.h
│ │ ├── vlp_grabber.h
│ │ └── vtk_io.h
│ ├── kdtree
│ │ ├── flann.h
│ │ ├── impl
│ │ │ ├── io.hpp
│ │ │ └── kdtree_flann.hpp
│ │ ├── io.h
│ │ ├── kdtree.h
│ │ └── kdtree_flann.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
│ │ ├── iss_3d.h
│ │ ├── keypoint.h
│ │ ├── narf_keypoint.h
│ │ ├── sift_keypoint.h
│ │ ├── smoothed_surfaces_keypoint.h
│ │ ├── susan.h
│ │ └── uniform_sampling.h
│ ├── ml
│ │ ├── branch_estimator.h
│ │ ├── decision_forest.h
│ │ ├── decision_forest_evaluator.h
│ │ ├── decision_forest_trainer.h
│ │ ├── decision_tree.h
│ │ ├── decision_tree_data_provider.h
│ │ ├── decision_tree_evaluator.h
│ │ ├── decision_tree_trainer.h
│ │ ├── densecrf.h
│ │ ├── feature_handler.h
│ │ ├── fern.h
│ │ ├── fern_evaluator.h
│ │ ├── fern_trainer.h
│ │ ├── 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
│ ├── octree
│ │ ├── boost.h
│ │ ├── impl
│ │ │ ├── octree2buf_base.hpp
│ │ │ ├── octree_base.hpp
│ │ │ ├── octree_iterator.hpp
│ │ │ ├── octree_pointcloud.hpp
│ │ │ ├── octree_pointcloud_adjacency.hpp
│ │ │ ├── octree_pointcloud_voxelcentroid.hpp
│ │ │ └── octree_search.hpp
│ │ ├── octree.h
│ │ ├── octree2buf_base.h
│ │ ├── octree_base.h
│ │ ├── octree_container.h
│ │ ├── octree_impl.h
│ │ ├── octree_iterator.h
│ │ ├── octree_key.h
│ │ ├── octree_nodes.h
│ │ ├── octree_pointcloud.h
│ │ ├── octree_pointcloud_adjacency.h
│ │ ├── octree_pointcloud_adjacency_container.h
│ │ ├── octree_pointcloud_changedetector.h
│ │ ├── octree_pointcloud_density.h
│ │ ├── octree_pointcloud_occupancy.h
│ │ ├── octree_pointcloud_pointvector.h
│ │ ├── octree_pointcloud_singlepoint.h
│ │ ├── octree_pointcloud_voxelcentroid.h
│ │ └── octree_search.h
│ ├── pcl_base.h
│ ├── pcl_config.h
│ ├── pcl_exports.h
│ ├── pcl_macros.h
│ ├── pcl_tests.h
│ ├── point_cloud.h
│ ├── point_representation.h
│ ├── point_traits.h
│ ├── point_types.h
│ ├── point_types_conversion.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
│ │ │ ├── line_rgbd.hpp
│ │ │ ├── linemod
│ │ │ │ └── line_rgbd.hpp
│ │ │ ├── ransac_based
│ │ │ │ ├── simple_octree.hpp
│ │ │ │ └── voxel_structure.hpp
│ │ │ ├── simple_octree.hpp
│ │ │ └── voxel_structure.hpp
│ │ ├── implicit_shape_model.h
│ │ ├── line_rgbd.h
│ │ ├── linemod
│ │ │ └── line_rgbd.h
│ │ ├── linemod.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.h
│ │ ├── boost_graph.h
│ │ ├── convergence_criteria.h
│ │ ├── correspondence_estimation.h
│ │ ├── correspondence_estimation_backprojection.h
│ │ ├── correspondence_estimation_normal_shooting.h
│ │ ├── correspondence_estimation_organized_projection.h
│ │ ├── correspondence_rejection.h
│ │ ├── correspondence_rejection_distance.h
│ │ ├── correspondence_rejection_features.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.h
│ │ ├── correspondence_rejection_sample_consensus_2d.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
│ │ ├── gicp.h
│ │ ├── gicp6d.h
│ │ ├── ia_fpcs.h
│ │ ├── ia_kfpcs.h
│ │ ├── ia_ransac.h
│ │ ├── icp.h
│ │ ├── icp_nl.h
│ │ ├── impl
│ │ │ ├── correspondence_estimation.hpp
│ │ │ ├── correspondence_estimation_backprojection.hpp
│ │ │ ├── correspondence_estimation_normal_shooting.hpp
│ │ │ ├── correspondence_estimation_organized_projection.hpp
│ │ │ ├── correspondence_rejection.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.hpp
│ │ │ ├── correspondence_rejection_sample_consensus_2d.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.hpp
│ │ │ ├── ndt_2d.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_validation_euclidean.hpp
│ │ ├── incremental_registration.h
│ │ ├── joint_icp.h
│ │ ├── lum.h
│ │ ├── matching_candidate.h
│ │ ├── meta_registration.h
│ │ ├── ndt.h
│ │ ├── ndt_2d.h
│ │ ├── pairwise_graph_registration.hpp
│ │ ├── ppf_registration.h
│ │ ├── pyramid_feature_matching.h
│ │ ├── registration.h
│ │ ├── sample_consensus_prerejective.h
│ │ ├── transformation_estimation.h
│ │ ├── transformation_estimation_2D.h
│ │ ├── transformation_estimation_3point.h
│ │ ├── transformation_estimation_dual_quaternion.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_validation.h
│ │ ├── transformation_validation_euclidean.h
│ │ ├── transforms.h
│ │ ├── warp_point_rigid.h
│ │ ├── warp_point_rigid_3d.h
│ │ └── warp_point_rigid_6d.h
│ ├── ros
│ │ ├── conversions.h
│ │ └── register_point_struct.h
│ ├── sample_consensus
│ │ ├── boost.h
│ │ ├── eigen.h
│ │ ├── impl
│ │ │ ├── lmeds.hpp
│ │ │ ├── mlesac.hpp
│ │ │ ├── msac.hpp
│ │ │ ├── prosac.hpp
│ │ │ ├── ransac.hpp
│ │ │ ├── rmsac.hpp
│ │ │ ├── rransac.hpp
│ │ │ ├── sac_model_circle.hpp
│ │ │ ├── sac_model_circle3d.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.hpp
│ │ │ ├── sac_model_registration_2d.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.h
│ │ ├── sac_model_circle.h
│ │ ├── sac_model_circle3d.h
│ │ ├── sac_model_cone.h
│ │ ├── sac_model_cylinder.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.h
│ │ ├── sac_model_registration_2d.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
│ │ │ ├── hash.h
│ │ │ ├── marching_cubes_poisson.h
│ │ │ ├── mat.h
│ │ │ ├── mat.hpp
│ │ │ ├── multi_grid_octree_data.h
│ │ │ ├── multi_grid_octree_data.hpp
│ │ │ ├── octree_poisson.h
│ │ │ ├── octree_poisson.hpp
│ │ │ ├── polynomial.h
│ │ │ ├── polynomial.hpp
│ │ │ ├── ppolynomial.h
│ │ │ ├── ppolynomial.hpp
│ │ │ ├── sparse_matrix.h
│ │ │ ├── sparse_matrix.hpp
│ │ │ ├── vector.h
│ │ │ └── vector.hpp
│ │ ├── bilateral_upsampling.h
│ │ ├── boost.h
│ │ ├── ear_clipping.h
│ │ ├── eigen.h
│ │ ├── gp3.h
│ │ ├── grid_projection.h
│ │ ├── impl
│ │ │ ├── bilateral_upsampling.hpp
│ │ │ ├── gp3.hpp
│ │ │ ├── grid_projection.hpp
│ │ │ ├── marching_cubes.hpp
│ │ │ ├── marching_cubes_hoppe.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
│ │ ├── reconstruction.h
│ │ ├── simplification_remove_unused_vertices.h
│ │ ├── surfel_smoothing.h
│ │ └── texture_mapping.h
│ └── tracking
│ ├── approx_nearest_pair_point_cloud_coherence.h
│ ├── boost.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
└── lib
├── pcl_common_release.lib
├── pcl_features_release.lib
├── pcl_filters_release.lib
├── pcl_io_ply_release.lib
├── pcl_io_release.lib
├── pcl_kdtree_release.lib
├── pcl_keypoints_release.lib
├── pcl_ml_release.lib
├── pcl_octree_release.lib
├── pcl_recognition_release.lib
├── pcl_registration_release.lib
├── pcl_sample_consensus_release.lib
├── pcl_search_release.lib
├── pcl_segmentation_release.lib
├── pcl_stereo_release.lib
├── pcl_surface_release.lib
├── pcl_tracking_release.lib
└── pkgconfig
├── pcl_common-1.8.pc
├── pcl_features-1.8.pc
├── pcl_filters-1.8.pc
├── pcl_geometry-1.8.pc
├── pcl_io-1.8.pc
├── pcl_kdtree-1.8.pc
├── pcl_keypoints-1.8.pc
├── pcl_ml-1.8.pc
├── pcl_octree-1.8.pc
├── pcl_recognition-1.8.pc
├── pcl_registration-1.8.pc
├── pcl_sample_consensus-1.8.pc
├── pcl_search-1.8.pc
├── pcl_segmentation-1.8.pc
├── pcl_stereo-1.8.pc
├── pcl_surface-1.8.pc
└── pcl_tracking-1.8.pc
63 directories, 911 files
小贴士
感谢您为本站写下的评论,您的评论对其它用户来说具有重要的参考价值,所以请认真填写。
- 类似“顶”、“沙发”之类没有营养的文字,对勤劳贡献的楼主来说是令人沮丧的反馈信息。
- 相信您也不想看到一排文字/表情墙,所以请不要反馈意义不大的重复字符,也请尽量不要纯表情的回复。
- 提问之前请再仔细看一遍楼主的说明,或许是您遗漏了。
- 请勿到处挖坑绊人、招贴广告。既占空间让人厌烦,又没人会搭理,于人于己都无利。
关于好例子网
本站旨在为广大IT学习爱好者提供一个非营利性互相学习交流分享平台。本站所有资源都可以被免费获取学习研究。本站资源来自网友分享,对搜索内容的合法性不具有预见性、识别性、控制性,仅供学习研究,请务必在下载后24小时内给予删除,不得用于其他任何用途,否则后果自负。基于互联网的特殊性,平台无法对用户传输的作品、信息、内容的权属或合法性、安全性、合规性、真实性、科学性、完整权、有效性等进行实质审查;无论平台是否已进行审查,用户均应自行承担因其传输的作品、信息、内容而可能或已经产生的侵权或权属纠纷等法律责任。本站所有资源不代表本站的观点或立场,基于网友分享,根据中国法律《信息网络传播权保护条例》第二十二与二十三条之规定,若资源存在侵权或相关问题请联系本站客服人员,点此联系我们。关于更多版权及免责申明参见 版权及免责申明
网友评论
我要评论