Typedefs | Functions
depth2cloud.cpp File Reference
#include <message_filters/subscriber.h>
#include <message_filters/synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/PointCloud2.h>
#include <string>
#include <ros/ros.h>
#include <pcl/io/io.h>
#include "pcl/point_cloud.h"
#include "pcl/point_types.h"
Include dependency graph for depth2cloud.cpp:

Go to the source code of this file.

Typedefs

typedef
mf::sync_policies::ApproximateTime
< sm::Image, sm::CameraInfo > 
NoCloudSyncPolicy
typedef pcl::PointXYZ point_type
typedef pcl::PointCloud
< point_type
pointcloud_type

Functions

pointcloud_typecreatePointCloud (const sm::ImageConstPtr &depth_msg, const sm::CameraInfoConstPtr &cam_info)
void depth_callback (const sm::ImageConstPtr &dimage, const sm::CameraInfoConstPtr &cam_info, ros::Publisher *cloud_pub)
int main (int argc, char **argv)

Typedef Documentation

typedef mf::sync_policies::ApproximateTime<sm::Image, sm::CameraInfo> NoCloudSyncPolicy

Definition at line 20 of file depth2cloud.cpp.

typedef pcl::PointXYZ point_type

Definition at line 18 of file depth2cloud.cpp.

Definition at line 19 of file depth2cloud.cpp.


Function Documentation

pointcloud_type* createPointCloud ( const sm::ImageConstPtr &  depth_msg,
const sm::CameraInfoConstPtr &  cam_info 
)

Reconstruct 3D data from intrinsic camera calibration and depth

Definition at line 23 of file depth2cloud.cpp.

void depth_callback ( const sm::ImageConstPtr &  dimage,
const sm::CameraInfoConstPtr &  cam_info,
ros::Publisher cloud_pub 
)

Definition at line 73 of file depth2cloud.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 84 of file depth2cloud.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


rgbd2cloud
Author(s): Felix Endres
autogenerated on Wed Dec 26 2012 15:31:24