#include <pcl/pcl_base.h>
#include <pcl/ros/conversions.h>
#include <boost/make_shared.hpp>
#include <cfloat>
Go to the source code of this file.
Classes | |
class | pcl::Filter< PointT > |
Filter represents the base filter class. All filters must inherit from this interface. More... | |
class | pcl::Filter< sensor_msgs::PointCloud2 > |
Filter represents the base filter class. All filters must inherit from this interface. More... | |
Namespaces | |
namespace | pcl |
Functions | |
template<typename PointT > | |
void | pcl::removeNaNFromPointCloud (const pcl::PointCloud< PointT > &cloud_in, pcl::PointCloud< PointT > &cloud_out, std::vector< int > &index) |
Removes points with x, y, or z equal to NaN. |