Classes | Namespaces | Functions
filter_indices.h File Reference
#include <pcl/filters/filter.h>
Include dependency graph for filter_indices.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  pcl::FilterIndices< PointT >
 FilterIndices represents the base class for filters that are about binary point removal.
All derived classes have to implement the filter (PointCloud &output) and the filter (std::vector<int> &indices) methods. Ideally they also make use of the negative_, keep_organized_ and extract_removed_indices_ systems. The distinguishment between the negative_ and extract_removed_indices_ systems only makes sense if the class automatically filters non-finite entries in the filtering methods (recommended). More...
class  pcl::FilterIndices< sensor_msgs::PointCloud2 >
 FilterIndices represents the base class for filters that are about binary point removal.
All derived classes have to implement the filter (PointCloud &output) and the filter (std::vector<int> &indices) methods. Ideally they also make use of the negative_, keep_organized_ and extract_removed_indices_ systems. The distinguishment between the negative_ and extract_removed_indices_ systems only makes sense if the class automatically filters non-finite entries in the filtering methods (recommended). More...

Namespaces

namespace  pcl

Functions

template<typename PointT >
void pcl::removeNaNFromPointCloud (const pcl::PointCloud< PointT > &cloud_in, std::vector< int > &index)
 Removes points with x, y, or z equal to NaN.


pcl
Author(s): Open Perception
autogenerated on Mon Oct 6 2014 03:19:12