Classes | Public Member Functions | Public Attributes | Private Types | Private Member Functions | Private Attributes | Static Private Attributes
PointCloudImage Class Reference

List of all members.

Classes

struct  p_cloud

Public Member Functions

void clear ()
void clear ()
void onInit ()
void onInit ()
void onInit ()
 PointCloudImage ()
 PointCloudImage ()
 PointCloudImage ()
virtual ~PointCloudImage ()
virtual ~PointCloudImage ()
virtual ~PointCloudImage ()

Public Attributes

int count
bool display
int Height
QImage img
image_transport::ImageTransport * it
QLabel * label
ros::NodeHandle nh
ros::NodeHandle pnh
int Width

Private Types

typedef std::deque< tcloudptr >
::iterator 
clouds_it
typedef
sensor_msgs::PointCloud2ConstPtr 
tcloudptr
typedef std::deque< cv::Mat >
::iterator 
w_clouds_it
typedef std::deque< cv::Mat >
::iterator 
w_clouds_it
 poit clouds mapped into fixed_frame

Private Member Functions

void cameraInfoCallback (const sensor_msgs::CameraInfoConstPtr &cameraInfoMsg)
void cameraInfoCallback (const sensor_msgs::CameraInfoConstPtr &cameraInfoMsg)
void cameraInfoCallback (const sensor_msgs::CameraInfoConstPtr &cameraInfoMsg)
void init_image (int width, int height)
void init_image (int width, int height)
void laser_display ()
void laser_publish (const sensor_msgs::CameraInfoConstPtr &cameraInfoMsg)
void laser_render (const sensor_msgs::CameraInfoConstPtr &cameraInfoMsg, const tf::StampedTransform &tf1)
void pointCloudCallback (const sensor_msgs::PointCloud2ConstPtr &cloudMsg)
void pointCloudCallback (const sensor_msgs::PointCloud2ConstPtr &cloudMsg)
void pointCloudCallback (const sensor_msgs::PointCloud2ConstPtr &cloudMsg)

Private Attributes

std::string camera_topic
ros::Subscriber cameraSubscriber
std::deque< tcloudptrclouds
GLuint d_render_buf
float farVal
GLuint fbo
std::string fixedFrame
dynamic::num_array< short
unsigned int, 2 > 
ilaser_image
image_transport::Publisher imagePublisher
bool laser_empty
dynamic::num_array< float, 2 > laser_image
ros::Time last_scan_t
double maxCloudAge
int pointCloudQueueSize
ros::Subscriber pointCloudSub
tf::TransformListener transformListener
std::deque< cv::Mat > w_clouds
double waitForTransform

Static Private Attributes

static const float zFar = 100
static const float zNear = 0.1

Detailed Description

Definition at line 105 of file back/point_cloud_to_camera.cpp.


Member Typedef Documentation

typedef std::deque<tcloudptr>::iterator PointCloudImage::clouds_it [private]

Definition at line 108 of file point_cloud_to_camera.cpp.

typedef sensor_msgs::PointCloud2ConstPtr PointCloudImage::tcloudptr [private]

Definition at line 106 of file point_cloud_to_camera.cpp.

typedef std::deque<cv::Mat>::iterator PointCloudImage::w_clouds_it [private]

Definition at line 134 of file back/point_cloud_to_camera.cpp.

typedef std::deque<cv::Mat>::iterator PointCloudImage::w_clouds_it [private]

poit clouds mapped into fixed_frame

Definition at line 149 of file laser_render.cpp.


Constructor & Destructor Documentation

Definition at line 144 of file back/point_cloud_to_camera.cpp.

Definition at line 158 of file back/point_cloud_to_camera.cpp.

virtual PointCloudImage::~PointCloudImage ( ) [virtual]
virtual PointCloudImage::~PointCloudImage ( ) [virtual]

Member Function Documentation

void PointCloudImage::cameraInfoCallback ( const sensor_msgs::CameraInfoConstPtr &  cameraInfoMsg) [private]
void PointCloudImage::cameraInfoCallback ( const sensor_msgs::CameraInfoConstPtr &  cameraInfoMsg) [private]

wait for the tf cloud_frame -> fixed_frame

Definition at line 259 of file back/point_cloud_to_camera.cpp.

void PointCloudImage::cameraInfoCallback ( const sensor_msgs::CameraInfoConstPtr &  cameraInfoMsg) [private]

Definition at line 162 of file back/point_cloud_to_camera.cpp.

void PointCloudImage::init_image ( int  width,
int  height 
) [private]

Definition at line 204 of file back/point_cloud_to_camera.cpp.

void PointCloudImage::init_image ( int  width,
int  height 
) [private]
void PointCloudImage::laser_display ( ) [private]

Definition at line 354 of file laser_render.cpp.

void PointCloudImage::laser_publish ( const sensor_msgs::CameraInfoConstPtr &  cameraInfoMsg) [private]

Definition at line 397 of file laser_render.cpp.

void PointCloudImage::laser_render ( const sensor_msgs::CameraInfoConstPtr &  cameraInfoMsg,
const tf::StampedTransform &  tf1 
) [private]

Definition at line 288 of file laser_render.cpp.

Definition at line 170 of file back/point_cloud_to_camera.cpp.

void PointCloudImage::pointCloudCallback ( const sensor_msgs::PointCloud2ConstPtr &  cloudMsg) [private]
void PointCloudImage::pointCloudCallback ( const sensor_msgs::PointCloud2ConstPtr &  cloudMsg) [private]

wait for the tf cloud_frame -> fixed_frame

Definition at line 661 of file back/point_cloud_to_camera.cpp.

void PointCloudImage::pointCloudCallback ( const sensor_msgs::PointCloud2ConstPtr &  cloudMsg) [private]

Member Data Documentation

std::string PointCloudImage::camera_topic [private]

Definition at line 131 of file back/point_cloud_to_camera.cpp.

ros::Subscriber PointCloudImage::cameraSubscriber [private]

Definition at line 126 of file back/point_cloud_to_camera.cpp.

std::deque<tcloudptr> PointCloudImage::clouds [private]

Definition at line 107 of file point_cloud_to_camera.cpp.

Definition at line 117 of file back/point_cloud_to_camera.cpp.

Definition at line 122 of file back/point_cloud_to_camera.cpp.

Definition at line 110 of file laser_render.cpp.

float PointCloudImage::farVal [private]

Definition at line 123 of file back/point_cloud_to_camera.cpp.

GLuint PointCloudImage::fbo [private]

Definition at line 122 of file back/point_cloud_to_camera.cpp.

std::string PointCloudImage::fixedFrame [private]

Definition at line 130 of file back/point_cloud_to_camera.cpp.

Definition at line 116 of file back/point_cloud_to_camera.cpp.

dynamic::num_array<short unsigned int,2> PointCloudImage::ilaser_image [private]

Definition at line 141 of file laser_render.cpp.

image_transport::Publisher PointCloudImage::imagePublisher [private]

Definition at line 127 of file back/point_cloud_to_camera.cpp.

Definition at line 113 of file back/point_cloud_to_camera.cpp.

image_transport::ImageTransport * PointCloudImage::it

Definition at line 120 of file back/point_cloud_to_camera.cpp.

Definition at line 112 of file back/point_cloud_to_camera.cpp.

Definition at line 127 of file laser_render.cpp.

dynamic::num_array< float, 2 > PointCloudImage::laser_image [private]

Definition at line 129 of file back/point_cloud_to_camera.cpp.

ros::Time PointCloudImage::last_scan_t [private]

Definition at line 142 of file laser_render.cpp.

double PointCloudImage::maxCloudAge [private]

Definition at line 109 of file point_cloud_to_camera.cpp.

ros::NodeHandle PointCloudImage::nh

Definition at line 118 of file back/point_cloud_to_camera.cpp.

ros::NodeHandle PointCloudImage::pnh

Definition at line 119 of file back/point_cloud_to_camera.cpp.

Definition at line 137 of file back/point_cloud_to_camera.cpp.

ros::Subscriber PointCloudImage::pointCloudSub [private]

Definition at line 128 of file back/point_cloud_to_camera.cpp.

tf::TransformListener PointCloudImage::transformListener [private]

Definition at line 125 of file back/point_cloud_to_camera.cpp.

std::deque< cv::Mat > PointCloudImage::w_clouds [private]

Definition at line 133 of file back/point_cloud_to_camera.cpp.

Definition at line 138 of file back/point_cloud_to_camera.cpp.

Definition at line 115 of file back/point_cloud_to_camera.cpp.

const float PointCloudImage::zFar = 100 [static, private]

Definition at line 133 of file laser_render.cpp.

const float PointCloudImage::zNear = 0.1 [static, private]

Definition at line 134 of file laser_render.cpp.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Defines


openni_cam
Author(s): Alexander Shekhovtsov
autogenerated on Sun Dec 1 2013 17:19:20