Public Member Functions | Private Attributes
CobTofCameraViewerNode Class Reference

List of all members.

Public Member Functions

 CobTofCameraViewerNode (const ros::NodeHandle &node_handle)
void greyImageCallback (const sensor_msgs::ImageConstPtr &grey_image_msg)
bool init ()
void xyzImageCallback (const sensor_msgs::ImageConstPtr &xyz_image_msg)
 ~CobTofCameraViewerNode ()
 Destructor.

Private Attributes

sensor_msgs::CvBridge cv_bridge_0_
sensor_msgs::CvBridge cv_bridge_1_
IplImage * grey_image_32F1_
 OpenCV image holding the transformed 8bit RGB point cloud.
int grey_image_counter_
 OpenCV image holding the transformed 8bit RGB amplitude values.
image_transport::Subscriber grey_image_subscriber_
 Subscribes to gray image data.
cv::Mat grey_mat_8U3_
 OpenCV image holding the 32bit amplitude values.
image_transport::ImageTransport image_transport_
 Image transport instance.
ros::NodeHandle m_NodeHandle
 Node handle.
IplImage * xyz_image_32F3_
image_transport::Subscriber xyz_image_subscriber_
 Subscribes to xyz image data.
cv::Mat xyz_mat_8U3_
 OpenCV image holding the 32bit point cloud.

Detailed Description

Definition at line 38 of file tof_camera_viewer.cpp.


Constructor & Destructor Documentation

Constructor.

Parameters:
node_handleNode handle instance

Void

Definition at line 60 of file tof_camera_viewer.cpp.

Destructor.

Do not release m_GrayImage32F3 Do not release xyz_image_32F3_ Image allocation is managed by Cv_Bridge object

Definition at line 73 of file tof_camera_viewer.cpp.


Member Function Documentation

void CobTofCameraViewerNode::greyImageCallback ( const sensor_msgs::ImageConstPtr &  grey_image_msg) [inline]

Topic callback functions. Function will be called when a new message arrives on a topic.

Parameters:
grey_image_msgThe gray values of point cloud, saved in a 32bit, 1 channel OpenCV IplImage

Do not release m_GrayImage32F3 Image allocation is managed by Cv_Bridge object

Definition at line 101 of file tof_camera_viewer.cpp.

bool CobTofCameraViewerNode::init ( ) [inline]

initialize tof camera viewer.

Returns:
false on failure, true otherwise

Create viewer windows

Definition at line 85 of file tof_camera_viewer.cpp.

void CobTofCameraViewerNode::xyzImageCallback ( const sensor_msgs::ImageConstPtr &  xyz_image_msg) [inline]

Topic callback functions. Function will be called when a new message arrives on a topic.

Parameters:
xyz_image_msgThe point cloud, saved in a 32bit, 3 channel OpenCV IplImage

Do not release xyz_image_32F3_ Image allocation is managed by Cv_Bridge object

Definition at line 139 of file tof_camera_viewer.cpp.


Member Data Documentation

sensor_msgs::CvBridge CobTofCameraViewerNode::cv_bridge_0_ [private]

Definition at line 47 of file tof_camera_viewer.cpp.

sensor_msgs::CvBridge CobTofCameraViewerNode::cv_bridge_1_ [private]

Definition at line 48 of file tof_camera_viewer.cpp.

OpenCV image holding the transformed 8bit RGB point cloud.

Definition at line 52 of file tof_camera_viewer.cpp.

OpenCV image holding the transformed 8bit RGB amplitude values.

Definition at line 55 of file tof_camera_viewer.cpp.

Subscribes to gray image data.

Definition at line 45 of file tof_camera_viewer.cpp.

OpenCV image holding the 32bit amplitude values.

Definition at line 53 of file tof_camera_viewer.cpp.

Image transport instance.

Definition at line 43 of file tof_camera_viewer.cpp.

Node handle.

Definition at line 41 of file tof_camera_viewer.cpp.

Definition at line 50 of file tof_camera_viewer.cpp.

Subscribes to xyz image data.

Definition at line 44 of file tof_camera_viewer.cpp.

OpenCV image holding the 32bit point cloud.

Definition at line 51 of file tof_camera_viewer.cpp.


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


cob_camera_sensors
Author(s): Jan Fischer , Richard Bormann
autogenerated on Sat Jun 8 2019 21:02:02