Public Member Functions | Private Member Functions | Private Attributes
rviz_interaction_tools::ImageOverlay Class Reference

#include <image_overlay.h>

List of all members.

Public Member Functions

void clear ()
int getHeight ()
Ogre::MaterialPtr getMaterial ()
int getWidth ()
 ImageOverlay (Ogre::SceneNode *scene_root, unsigned char render_queue_group)
bool setImage (const sensor_msgs::Image &image, const stereo_msgs::DisparityImage &disparity_image)
bool setImage (const sensor_msgs::Image &image)
bool setImage (unsigned char *rgb_data, int width, int height)
 copy RGB data to texture
bool update ()
virtual ~ImageOverlay ()

Private Member Functions

bool setImageNoLock (const sensor_msgs::Image &image)

Private Attributes

int count_
Ogre::Image empty_image_
int height_
std::vector< unsigned char > image_buffer_
Ogre::Rectangle2D * image_rect_
boost::mutex mutex_
bool new_image_
std::string resource_group_name_
Ogre::SceneNode * scene_root_
Ogre::TexturePtr texture_
Ogre::MaterialPtr texture_material_
int width_

Detailed Description

paints an image, filling the whole viewport performs locking so it can used in a thread-safe way

Definition at line 54 of file image_overlay.h.


Constructor & Destructor Documentation

rviz_interaction_tools::ImageOverlay::ImageOverlay ( Ogre::SceneNode *  scene_root,
unsigned char  render_queue_group 
)

Definition at line 49 of file image_overlay.cpp.

Definition at line 117 of file image_overlay.cpp.


Member Function Documentation

Definition at line 282 of file image_overlay.cpp.

Definition at line 298 of file image_overlay.cpp.

Ogre::MaterialPtr rviz_interaction_tools::ImageOverlay::getMaterial ( ) [inline]

Definition at line 83 of file image_overlay.h.

Definition at line 291 of file image_overlay.cpp.

bool rviz_interaction_tools::ImageOverlay::setImage ( const sensor_msgs::Image &  image,
const stereo_msgs::DisparityImage &  disparity_image 
)

copy mono or RGB image to texture, color areas with missing disparity in red (if present)

Note:
disparity_image is optional
you have to call update() for the changes to take effect

Definition at line 124 of file image_overlay.cpp.

bool rviz_interaction_tools::ImageOverlay::setImage ( const sensor_msgs::Image &  image)

Definition at line 167 of file image_overlay.cpp.

bool rviz_interaction_tools::ImageOverlay::setImage ( unsigned char *  rgb_data,
int  width,
int  height 
)

copy RGB data to texture

Definition at line 228 of file image_overlay.cpp.

bool rviz_interaction_tools::ImageOverlay::setImageNoLock ( const sensor_msgs::Image &  image) [private]

Definition at line 180 of file image_overlay.cpp.

Definition at line 247 of file image_overlay.cpp.


Member Data Documentation

Definition at line 92 of file image_overlay.h.

Definition at line 96 of file image_overlay.h.

Definition at line 105 of file image_overlay.h.

Definition at line 103 of file image_overlay.h.

Definition at line 97 of file image_overlay.h.

Definition at line 90 of file image_overlay.h.

Definition at line 102 of file image_overlay.h.

Definition at line 107 of file image_overlay.h.

Definition at line 99 of file image_overlay.h.

Definition at line 95 of file image_overlay.h.

Definition at line 94 of file image_overlay.h.

Definition at line 104 of file image_overlay.h.


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


rviz_interaction_tools
Author(s): David Gossow
autogenerated on Thu Jan 2 2014 11:37:58