Public Member Functions | Protected Member Functions | Protected Attributes | Private Member Functions | Private Attributes
gazebo::GazeboRosOpenniKinect Class Reference

#include <gazebo_ros_openni_kinect.h>

Inheritance diagram for gazebo::GazeboRosOpenniKinect:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 GazeboRosOpenniKinect ()
 Constructor.
virtual void Load (sensors::SensorPtr _parent, sdf::ElementPtr _sdf)
 Load the plugin.
 ~GazeboRosOpenniKinect ()
 Destructor.

Protected Member Functions

virtual void OnNewDepthFrame (const float *_image, unsigned int _width, unsigned int _height, unsigned int _depth, const std::string &_format)
 Update the controller.
virtual void OnNewImageFrame (const unsigned char *_image, unsigned int _width, unsigned int _height, unsigned int _depth, const std::string &_format)
 Update the controller.
virtual void PublishCameraInfo ()

Protected Attributes

ros::Publisher depth_image_camera_info_pub_

Private Member Functions

void DepthImageConnect ()
void DepthImageDisconnect ()
void DepthInfoConnect ()
void DepthInfoDisconnect ()
void FillDepthImage (const float *_src)
 push depth image data into ros topic
bool FillDepthImageHelper (sensor_msgs::Image &image_msg, uint32_t height, uint32_t width, uint32_t step, void *data_arg)
bool FillPointCloudHelper (sensor_msgs::PointCloud2 &point_cloud_msg, uint32_t rows_arg, uint32_t cols_arg, uint32_t step_arg, void *data_arg)
void FillPointdCloud (const float *_src)
 push point cloud data into ros topic
void PointCloudConnect ()
void PointCloudDisconnect ()

Private Attributes

std::string depth_image_camera_info_topic_name_
int depth_image_connect_count_
 Keep track of number of connctions for point clouds.
sensor_msgs::Image depth_image_msg_
ros::Publisher depth_image_pub_
std::string depth_image_topic_name_
 image where each pixel contains the depth data
int depth_info_connect_count_
common::Time depth_sensor_update_time_
common::Time last_depth_image_camera_info_update_time_
int point_cloud_connect_count_
 Keep track of number of connctions for point clouds.
double point_cloud_cutoff_
sensor_msgs::PointCloud2 point_cloud_msg_
 PCL point cloud message.
ros::Publisher point_cloud_pub_
 A pointer to the ROS node. A node will be instantiated if it does not exist.
std::string point_cloud_topic_name_
 ROS image topic name.

Detailed Description

Definition at line 67 of file gazebo_ros_openni_kinect.h.


Constructor & Destructor Documentation

Constructor.

Parameters:
parentThe parent entity, must be a Model or a Sensor

Definition at line 52 of file gazebo_ros_openni_kinect.cpp.

Destructor.

Definition at line 61 of file gazebo_ros_openni_kinect.cpp.


Member Function Documentation

Definition at line 154 of file gazebo_ros_openni_kinect.cpp.

Definition at line 161 of file gazebo_ros_openni_kinect.cpp.

Definition at line 168 of file gazebo_ros_openni_kinect.cpp.

Definition at line 174 of file gazebo_ros_openni_kinect.cpp.

void gazebo::GazeboRosOpenniKinect::FillDepthImage ( const float *  _src) [private]

push depth image data into ros topic

copy from depth to depth image message

Definition at line 270 of file gazebo_ros_openni_kinect.cpp.

bool gazebo::GazeboRosOpenniKinect::FillDepthImageHelper ( sensor_msgs::Image &  image_msg,
uint32_t  height,
uint32_t  width,
uint32_t  step,
void *  data_arg 
) [private]

Definition at line 374 of file gazebo_ros_openni_kinect.cpp.

bool gazebo::GazeboRosOpenniKinect::FillPointCloudHelper ( sensor_msgs::PointCloud2 &  point_cloud_msg,
uint32_t  rows_arg,
uint32_t  cols_arg,
uint32_t  step_arg,
void *  data_arg 
) [private]

Definition at line 292 of file gazebo_ros_openni_kinect.cpp.

void gazebo::GazeboRosOpenniKinect::FillPointdCloud ( const float *  _src) [private]

push point cloud data into ros topic

copy from depth to point cloud message

Definition at line 245 of file gazebo_ros_openni_kinect.cpp.

void gazebo::GazeboRosOpenniKinect::Load ( sensors::SensorPtr  _parent,
sdf::ElementPtr  _sdf 
) [virtual]

Load the plugin.

Parameters:
takein SDF root element

Reimplemented from gazebo::GazeboRosCameraUtils.

Definition at line 67 of file gazebo_ros_openni_kinect.cpp.

void gazebo::GazeboRosOpenniKinect::OnNewDepthFrame ( const float *  _image,
unsigned int  _width,
unsigned int  _height,
unsigned int  _depth,
const std::string &  _format 
) [protected, virtual]

Update the controller.

Definition at line 181 of file gazebo_ros_openni_kinect.cpp.

void gazebo::GazeboRosOpenniKinect::OnNewImageFrame ( const unsigned char *  _image,
unsigned int  _width,
unsigned int  _height,
unsigned int  _depth,
const std::string &  _format 
) [protected, virtual]

Update the controller.

Definition at line 214 of file gazebo_ros_openni_kinect.cpp.

Definition at line 136 of file gazebo_ros_openni_kinect.cpp.

Definition at line 144 of file gazebo_ros_openni_kinect.cpp.

void gazebo::GazeboRosOpenniKinect::PublishCameraInfo ( ) [protected, virtual]

Reimplemented from gazebo::GazeboRosCameraUtils.

Definition at line 412 of file gazebo_ros_openni_kinect.cpp.


Member Data Documentation

Definition at line 138 of file gazebo_ros_openni_kinect.h.

Definition at line 133 of file gazebo_ros_openni_kinect.h.

Keep track of number of connctions for point clouds.

Definition at line 102 of file gazebo_ros_openni_kinect.h.

Definition at line 120 of file gazebo_ros_openni_kinect.h.

Definition at line 116 of file gazebo_ros_openni_kinect.h.

image where each pixel contains the depth data

Definition at line 129 of file gazebo_ros_openni_kinect.h.

Definition at line 134 of file gazebo_ros_openni_kinect.h.

Definition at line 130 of file gazebo_ros_openni_kinect.h.

Definition at line 137 of file gazebo_ros_openni_kinect.h.

Keep track of number of connctions for point clouds.

Definition at line 97 of file gazebo_ros_openni_kinect.h.

Definition at line 122 of file gazebo_ros_openni_kinect.h.

sensor_msgs::PointCloud2 gazebo::GazeboRosOpenniKinect::point_cloud_msg_ [private]

PCL point cloud message.

Definition at line 119 of file gazebo_ros_openni_kinect.h.

A pointer to the ROS node. A node will be instantiated if it does not exist.

Definition at line 115 of file gazebo_ros_openni_kinect.h.

ROS image topic name.

Definition at line 125 of file gazebo_ros_openni_kinect.h.


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


gazebo_plugins
Author(s): Sachin Chitta, Stu Glaser, John Hsu
autogenerated on Mon Oct 6 2014 12:15:44