Classes | Typedefs | Functions
texture_point_cloud.cpp File Reference
#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>
Include dependency graph for texture_point_cloud.cpp:

Go to the source code of this file.

Classes

class  TexturingNode
 

Typedefs

using PointCloud = pcl::PointCloud< pcl::PointXYZ >
 
using TexturedPointCloud = pcl::PointCloud< pcl::PointXYZRGB >
 

Functions

int main (int argc, char **argv)
 
TexturedPointCloud::Ptr texturePointCloudFromRectifiedImage (cv::Mat const &image, PointCloud::ConstPtr const &pointCloud)
 

Typedef Documentation

using PointCloud = pcl::PointCloud<pcl::PointXYZ>

Definition at line 11 of file texture_point_cloud.cpp.

using TexturedPointCloud = pcl::PointCloud<pcl::PointXYZRGB>

Definition at line 12 of file texture_point_cloud.cpp.

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 132 of file texture_point_cloud.cpp.

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.



ensenso_camera
Author(s): Ensenso
autogenerated on Thu May 16 2019 02:44:23