Public Member Functions | Protected Types | Protected Member Functions | Protected Attributes
depthcloud::DepthCloudEncoder Class Reference

#include <depthcloud_encoder.h>

List of all members.

Public Member Functions

 DepthCloudEncoder (ros::NodeHandle &nh, ros::NodeHandle &pnh)
virtual ~DepthCloudEncoder ()

Protected Types

typedef
message_filters::Synchronizer
< SyncPolicyDepthColor
SynchronizerDepthColor
typedef
message_filters::sync_policies::ApproximateTime
< sensor_msgs::Image,
sensor_msgs::Image > 
SyncPolicyDepthColor

Protected Member Functions

void connectCb ()
void depthCB (const sensor_msgs::ImageConstPtr &depth_msg)
void depthColorCB (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &color_msg)
void depthInterpolation (sensor_msgs::ImageConstPtr depth_msg, sensor_msgs::ImagePtr depth_int_msg, sensor_msgs::ImagePtr mask_msg)
void process (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &color_msg, const std::size_t crop_size)
void subscribe (std::string &depth_topic, std::string &color_topic)
void unsubscribe ()

Protected Attributes

boost::shared_ptr
< image_transport::SubscriberFilter
color_sub_
boost::mutex connect_mutex_
std::size_t crop_size_
boost::shared_ptr
< image_transport::SubscriberFilter
depth_sub_
std::string depthmap_topic_
ros::NodeHandlenh_
ros::NodeHandlepnh_
image_transport::Publisher pub_
image_transport::ImageTransport pub_it_
std::string rgb_image_topic_
boost::shared_ptr
< SynchronizerDepthColor
sync_depth_color_

Detailed Description

Definition at line 58 of file depthcloud_encoder.h.


Member Typedef Documentation

Definition at line 83 of file depthcloud_encoder.h.

Definition at line 82 of file depthcloud_encoder.h.


Constructor & Destructor Documentation

Definition at line 54 of file depthcloud_encoder.cpp.

Definition at line 78 of file depthcloud_encoder.cpp.


Member Function Documentation

Definition at line 82 of file depthcloud_encoder.cpp.

void depthcloud::DepthCloudEncoder::depthCB ( const sensor_msgs::ImageConstPtr &  depth_msg) [protected]

Definition at line 152 of file depthcloud_encoder.cpp.

void depthcloud::DepthCloudEncoder::depthColorCB ( const sensor_msgs::ImageConstPtr &  depth_msg,
const sensor_msgs::ImageConstPtr &  color_msg 
) [protected]

Definition at line 157 of file depthcloud_encoder.cpp.

void depthcloud::DepthCloudEncoder::depthInterpolation ( sensor_msgs::ImageConstPtr  depth_msg,
sensor_msgs::ImagePtr  depth_int_msg,
sensor_msgs::ImagePtr  mask_msg 
) [protected]

Definition at line 372 of file depthcloud_encoder.cpp.

void depthcloud::DepthCloudEncoder::process ( const sensor_msgs::ImageConstPtr &  depth_msg,
const sensor_msgs::ImageConstPtr &  color_msg,
const std::size_t  crop_size 
) [protected]

Definition at line 164 of file depthcloud_encoder.cpp.

void depthcloud::DepthCloudEncoder::subscribe ( std::string &  depth_topic,
std::string &  color_topic 
) [protected]

Definition at line 96 of file depthcloud_encoder.cpp.

Definition at line 137 of file depthcloud_encoder.cpp.


Member Data Documentation

Definition at line 90 of file depthcloud_encoder.h.

Definition at line 94 of file depthcloud_encoder.h.

Definition at line 99 of file depthcloud_encoder.h.

Definition at line 89 of file depthcloud_encoder.h.

Definition at line 101 of file depthcloud_encoder.h.

Definition at line 85 of file depthcloud_encoder.h.

Definition at line 86 of file depthcloud_encoder.h.

Definition at line 97 of file depthcloud_encoder.h.

Definition at line 96 of file depthcloud_encoder.h.

Definition at line 102 of file depthcloud_encoder.h.

Definition at line 92 of file depthcloud_encoder.h.


The documentation for this class was generated from the following files:


depthcloud_encoder
Author(s): Julius Kammer
autogenerated on Sun Oct 5 2014 23:24:31