Typedefs | Functions | Variables
compressor.cpp File Reference
#include <iostream>
#include <ros/ros.h>
#include <sensor_msgs/PointCloud2.h>
#include <std_msgs/String.h>
#include <sstream>
#include <stdio.h>
#include <stdlib.h>
#include <pcl/compression/octree_pointcloud_compression.h>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/ros/conversions.h>
#include <compressed_pointcloud_transport/CompressedPointCloud.h>
Include dependency graph for compressor.cpp:

Go to the source code of this file.

Typedefs

typedef pcl::PointXYZRGB PointT

Functions

void cloud_cb (const sensor_msgs::PointCloud2::ConstPtr &rosCloud)
pcl::octree::compression_Profiles_e getCompressionProfile (ros::NodeHandle nh)
int main (int argc, char **argv)
pcl::PointCloud< PointT >::Ptr pclCloud (new pcl::PointCloud< PointT >)

Variables

pcl::octree::PointCloudCompression
< PointT > * 
PointCloudEncoder
ros::Publisher pub

Typedef Documentation

typedef pcl::PointXYZRGB PointT

Definition at line 19 of file compressor.cpp.


Function Documentation

void cloud_cb ( const sensor_msgs::PointCloud2::ConstPtr &  rosCloud)

Definition at line 27 of file compressor.cpp.

pcl::octree::compression_Profiles_e getCompressionProfile ( ros::NodeHandle  nh)

Definition at line 59 of file compressor.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 84 of file compressor.cpp.


Variable Documentation

pcl::octree::PointCloudCompression<PointT>* PointCloudEncoder

Definition at line 22 of file compressor.cpp.

Definition at line 21 of file compressor.cpp.



compressed_pointcloud_transport
Author(s):
autogenerated on Thu Jan 2 2014 11:37:47