#include <cv_bridge/cv_bridge.h>
#include <image_transport/image_transport.h>
#include <pcl_ros/point_cloud.h>
#include <ros/ros.h>
#include <sensor_msgs/Image.h>
#include <mutex>
#include <string>
Go to the source code of this file.
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
TexturedPointCloud::Ptr texturePointCloudFromRectifiedImage |
( |
cv::Mat const & |
image, |
|
|
PointCloud::ConstPtr const & |
pointCloud |
|
) |
| |
Texture the given point cloud from a rectified image. This assumes that the point cloud has the same format as the image and we can therefore associate points with image pixels by their coordinates.
Definition at line 19 of file texture_point_cloud.cpp.