#include <ros/ros.h>#include "ros/package.h"#include <tf/tf.h>#include <tf/transform_listener.h>#include <pcl/point_cloud.h>#include <pcl_conversions/pcl_conversions.h>#include <pcl/common/transforms.h>#include <pcl_ros/transforms.h>#include <opencv2/opencv.hpp>#include <cv_bridge/cv_bridge.h>#include <image_geometry/pinhole_camera_model.h>#include <sensor_msgs/CameraInfo.h>#include <message_filters/subscriber.h>#include <message_filters/synchronizer.h>#include <message_filters/sync_policies/approximate_time.h>
Go to the source code of this file.
Macros | |
| #define | DEBUG 1 |
Typedefs | |
| typedef pcl::PointCloud< pcl::PointXYZRGB > | PointCloudXYZRGB |
Functions | |
| void | callback (const PointCloud2::ConstPtr &pcl_msg, const CameraInfoConstPtr &cinfo_msg, const ImageConstPtr &image_msg) |
| int | main (int argc, char **argv) |
Variables | |
| ros::Publisher | pcl_pub |
| string | source_frame |
| string | target_frame |
| #define DEBUG 1 |
Definition at line 25 of file pcl_coloring.cpp.
| typedef pcl::PointCloud<pcl::PointXYZRGB> PointCloudXYZRGB |
Definition at line 46 of file pcl_coloring.cpp.
| void callback | ( | const PointCloud2::ConstPtr & | pcl_msg, |
| const CameraInfoConstPtr & | cinfo_msg, | ||
| const ImageConstPtr & | image_msg | ||
| ) |
Definition at line 50 of file pcl_coloring.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 109 of file pcl_coloring.cpp.
| ros::Publisher pcl_pub |
Definition at line 47 of file pcl_coloring.cpp.
| string source_frame |
Definition at line 48 of file pcl_coloring.cpp.
| string target_frame |
Definition at line 48 of file pcl_coloring.cpp.