#include <pcl/filters/filter.h>
#include "pcl_ros/pcl_nodelet.h"
#include <dynamic_reconfigure/server.h>
#include "pcl_ros/FilterConfig.h"
#include <geometry_msgs/Point.h>
#include <pcl_ros/filters/filter.h>
#include <segbot_sensors/SegbotVelodyneOutlierRemovalConfig.h>
Go to the source code of this file.
Classes | |
class | segbot_sensors::Filter |
Filter represents the base filter class. Some generic 3D operations that are applicable to all filters are defined here as static methods. More... | |
class | segbot_sensors::SegbotVelodyneOutlierRemoval |
Namespaces | |
namespace | segbot_sensors |