#include "pcl/point_types.h"
#include "pcl/filters/filter.h"
#include "pcl/kdtree/kdtree_flann.h"
#include "pcl/common/common.h"
Go to the source code of this file.
Classes | |
class | pcl::StatisticalOutlierRemoval< PointT > |
StatisticalOutlierRemoval uses point neighborhood statistics to filter outlier data. For more information check: More... | |
class | pcl::StatisticalOutlierRemoval< sensor_msgs::PointCloud2 > |
StatisticalOutlierRemoval uses point neighborhood statistics to filter outlier data. For more information check: More... | |
Namespaces | |
namespace | pcl |