#include <ros/ros.h>
#include <message_filters/subscriber.h>
#include <geometry_msgs/PointStamped.h>
#include <sensor_msgs/PointCloud2.h>
#include <tf/tf.h>
#include <tf/transform_listener.h>
#include <tf/message_filter.h>
#include <pcl_ros/point_cloud.h>
#include <pcl_ros/transforms.h>
#include <boost/foreach.hpp>
#include <float.h>
#include <srs_ui_but/ClosestPoint.h>
Go to the source code of this file.
Classes | |
class | srs_ui_but::PointCloudTools |
This class gathers actual point cloud data and provides method which returns closest point from a specified link. More... | |
Namespaces | |
namespace | srs_ui_but |