#include <geometry_msgs/PolygonStamped.h>
#include <pluginlib/class_list_macros.h>
#include <segbot_sensors/segbot_velodyne_outlier_removal.h>
#include <pcl/io/io.h>
#include "pcl_ros/transforms.h"
#include "pcl_ros/filters/filter.h"
Go to the source code of this file.
Typedefs | |
typedef segbot_sensors::SegbotVelodyneOutlierRemoval | SegbotVelodyneOutlierRemoval |
Functions | |
PLUGINLIB_EXPORT_CLASS (SegbotVelodyneOutlierRemoval, nodelet::Nodelet) |
Definition at line 309 of file segbot_velodyne_outlier_removal.cpp.