depth_sensor_pose package More...
#include <ros/console.h>#include <ros/ros.h>#include <sensor_msgs/Image.h>#include <sensor_msgs/LaserScan.h>#include <sensor_msgs/image_encodings.h>#include <image_geometry/pinhole_camera_model.h>#include <sstream>#include <limits.h>#include <math.h>#include <vector>#include <cmath>#include <string>#include <boost/lexical_cast.hpp>#include <iostream>#include <fstream>#include <pcl/point_types.h>#include <pcl/sample_consensus/ransac.h>#include <pcl/sample_consensus/sac_model_plane.h>#include <pcl/sample_consensus/method_types.h>#include <pcl/sample_consensus/model_types.h>#include <pcl/segmentation/sac_segmentation.h>#include <Eigen/Core>

Go to the source code of this file.
Classes | |
| class | depth_sensor_pose::DepthSensorPose |
Namespaces | |
| namespace | depth_sensor_pose |
Defines | |
| #define | DEBUG 1 |
Functions | |
| template<typename T > | |
| std::string | depth_sensor_pose::NumberToString (T Number) |
| #define DEBUG 1 |
Definition at line 67 of file depth_sensor_pose.h.