#include <iri_finddd/FindddConfig.h>
#include "mutex.h"
#include <sensor_msgs/PointCloud2.h>
#include <iri_perception_msgs/DescriptorSet.h>
#include <pcl_ros/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/ros/conversions.h>
#include <pcl/features/normal_3d.h>
#include <pcl/features/integral_image_normal.h>
#include <cmath>
#include <vector>
#include <sstream>
#include <time.h>
#include <iostream>
#include <fstream>
#include <pcl/io/pcd_io.h>
Go to the source code of this file.
Classes | |
class | FindddAlgorithm |
IRI ROS Specific Driver Class. More... | |
Functions | |
template<class T > | |
std::string | to_string (const T &t) |
std::string to_string | ( | const T & | t | ) | [inline] |
Definition at line 48 of file finddd_alg.h.