Public Member Functions | Public Attributes | Private Types | Private Member Functions | Private Attributes
openni_camera::OpenNIRecordPlayerNodelet Class Reference

#include <openni_record_player_nodelet.h>

Inheritance diagram for openni_camera::OpenNIRecordPlayerNodelet:
Inheritance graph
[legend]

List of all members.

Public Member Functions

virtual ~OpenNIRecordPlayerNodelet ()

Public Attributes

 EIGEN_MAKE_ALIGNED_OPERATOR_NEW

Private Types

typedef semanticmodel::OpenNIConfig Config
typedef
dynamic_reconfigure::Server
< Config
ReconfigureServer
typedef
message_filters::Synchronizer
< SyncPolicy
Synchronizer
typedef
message_filters::sync_policies::ApproximateTime
< sensor_msgs::Image,
sensor_msgs::Image > 
SyncPolicy

Private Member Functions

void configCallback (Config &config, uint32_t level)
void depthCallback (const sensor_msgs::ImageConstPtr &depth_msg)
sensor_msgs::CameraInfoPtr fillCameraInfo (const std_msgs::Header &header, unsigned int width, unsigned int height)
void imageCallback (const sensor_msgs::ImageConstPtr &img_msg)
bool isDepthStreamRequired () const
bool isImageStreamRequired () const
void maskIndicesCb (const pcl::PointIndicesConstPtr &indices)
 Store provided indices for later use in masking the point cloud.
virtual void onInit ()
 Nodelet initialization routine.
void publishDepthImage (const sensor_msgs::ImageConstPtr &depth_msg) const
void publishDisparity (const sensor_msgs::ImageConstPtr &depth_msg) const
void publishGrayImage (const sensor_msgs::ImageConstPtr &img_msg) const
void publishRgbImage (const sensor_msgs::ImageConstPtr &img_msg) const
void publishXYZPointCloud (const sensor_msgs::ImageConstPtr &depth_msg) const
void publishXYZRGBPointCloud (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &rgb_msg) const
void subscriberChangedEvent ()

Private Attributes

Config config_
boost::shared_ptr< Synchronizerdepth_rgb_sync_
image_transport::Subscriber depth_sub_
bool generate_camera_info_
 in case didnot recorded camera info
image_transport::Subscriber img_sub_
std::vector< int32_t > mask_indices_
 vector to hold the 'mask' (indices to output)
ros::Publisher pub_depth_cam_info_
image_transport::Publisher pub_depth_image_
ros::Publisher pub_disparity_
ros::Publisher pub_point_cloud_
ros::Publisher pub_point_cloud_rgb_
ros::Publisher pub_rgb_cam_info_
boost::recursive_mutex reconfigure_mutex_
boost::shared_ptr
< ReconfigureServer
reconfigure_server_
 reconfigure server
ros::Subscriber sub_mask_indices_
 ROS subscribers.
bool use_indices_
 whether to listen for mask_indices

Detailed Description

Definition at line 57 of file openni_record_player_nodelet.h.


Member Typedef Documentation

typedef semanticmodel::OpenNIConfig openni_camera::OpenNIRecordPlayerNodelet::Config [private]

Definition at line 62 of file openni_record_player_nodelet.h.

Definition at line 63 of file openni_record_player_nodelet.h.

Definition at line 65 of file openni_record_player_nodelet.h.

Definition at line 64 of file openni_record_player_nodelet.h.


Constructor & Destructor Documentation


Member Function Documentation

void openni_camera::OpenNIRecordPlayerNodelet::configCallback ( Config config,
uint32_t  level 
) [private]
void openni_camera::OpenNIRecordPlayerNodelet::depthCallback ( const sensor_msgs::ImageConstPtr &  depth_msg) [private]
sensor_msgs::CameraInfoPtr openni_camera::OpenNIRecordPlayerNodelet::fillCameraInfo ( const std_msgs::Header header,
unsigned int  width,
unsigned int  height 
) [private]
void openni_camera::OpenNIRecordPlayerNodelet::imageCallback ( const sensor_msgs::ImageConstPtr &  img_msg) [private]

Definition at line 128 of file openni_record_player_nodelet.h.

Definition at line 123 of file openni_record_player_nodelet.h.

Store provided indices for later use in masking the point cloud.

virtual void openni_camera::OpenNIRecordPlayerNodelet::onInit ( ) [private, virtual]

Nodelet initialization routine.

Implements nodelet::Nodelet.

void openni_camera::OpenNIRecordPlayerNodelet::publishDepthImage ( const sensor_msgs::ImageConstPtr &  depth_msg) const [private]
void openni_camera::OpenNIRecordPlayerNodelet::publishDisparity ( const sensor_msgs::ImageConstPtr &  depth_msg) const [private]
void openni_camera::OpenNIRecordPlayerNodelet::publishGrayImage ( const sensor_msgs::ImageConstPtr &  img_msg) const [private]
void openni_camera::OpenNIRecordPlayerNodelet::publishRgbImage ( const sensor_msgs::ImageConstPtr &  img_msg) const [private]
void openni_camera::OpenNIRecordPlayerNodelet::publishXYZPointCloud ( const sensor_msgs::ImageConstPtr &  depth_msg) const [private]
void openni_camera::OpenNIRecordPlayerNodelet::publishXYZRGBPointCloud ( const sensor_msgs::ImageConstPtr &  depth_msg,
const sensor_msgs::ImageConstPtr &  rgb_msg 
) const [private]

Member Data Documentation

Definition at line 108 of file openni_record_player_nodelet.h.

Definition at line 92 of file openni_record_player_nodelet.h.

Definition at line 83 of file openni_record_player_nodelet.h.

Definition at line 120 of file openni_record_player_nodelet.h.

in case didnot recorded camera info

Definition at line 114 of file openni_record_player_nodelet.h.

Definition at line 82 of file openni_record_player_nodelet.h.

vector to hold the 'mask' (indices to output)

Definition at line 118 of file openni_record_player_nodelet.h.

Definition at line 88 of file openni_record_player_nodelet.h.

Definition at line 86 of file openni_record_player_nodelet.h.

Definition at line 87 of file openni_record_player_nodelet.h.

Definition at line 87 of file openni_record_player_nodelet.h.

Definition at line 87 of file openni_record_player_nodelet.h.

Definition at line 88 of file openni_record_player_nodelet.h.

Definition at line 109 of file openni_record_player_nodelet.h.

reconfigure server

Definition at line 107 of file openni_record_player_nodelet.h.

ROS subscribers.

Definition at line 90 of file openni_record_player_nodelet.h.

whether to listen for mask_indices

Definition at line 116 of file openni_record_player_nodelet.h.


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


semanticmodel
Author(s): Julian ("Mac") Mason
autogenerated on Thu Dec 12 2013 12:39:10