#include "node.hpp"#include <opencv2/opencv.hpp>#include <pcl/io/pcd_io.h>#include <pcl_ros/point_cloud.h>#include <pcl_conversions/pcl_conversions.h>#include <pcl/common/transforms.h>#include <eigen_conversions/eigen_msg.h>#include <tf_conversions/tf_eigen.h>#include <sensor_msgs/image_encodings.h>#include <cv_bridge/cv_bridge.h>#include <message_filters/subscriber.h>#include <message_filters/time_synchronizer.h>#include <boost/bind.hpp>#include <boost/thread/future.hpp>
Go to the source code of this file.
Namespaces | |
| namespace | camera_pose_calibration |
Typedefs | |
| typedef std::pair < sensor_msgs::Image::ConstPtr, sensor_msgs::PointCloud2::ConstPtr > | camera_pose_calibration::InputData |
Functions | |
| void | camera_pose_calibration::synchronizationCallback (boost::promise< InputData > &promise, sensor_msgs::Image::ConstPtr image, sensor_msgs::PointCloud2::ConstPtr cloud) |