$search
#include <ros_image_texture.h>
Public Member Functions | |
void | clear () |
uint32_t | getHeight () |
const Ogre::TexturePtr & | getTexture () |
uint32_t | getWidth () |
ROSImageTexture () | |
void | setNewImage (sensor_msgs::Image::Ptr new_image_) |
void | setSize (uint32_t width, uint32_t height) |
void | setTopic (const std::string &topic) |
bool | update () |
~ROSImageTexture () | |
Private Attributes | |
sensor_msgs::Image::Ptr | current_image_ |
Ogre::Image | empty_image_ |
uint32_t | height_ |
uint32_t | image_count_ |
Ogre::TexturePtr | texture_ |
uint32_t | width_ |
Definition at line 65 of file ros_image_texture.h.
image_segmentation_demo::ROSImageTexture::ROSImageTexture | ( | ) |
Definition at line 40 of file ros_image_texture.cpp.
image_segmentation_demo::ROSImageTexture::~ROSImageTexture | ( | ) |
Definition at line 54 of file ros_image_texture.cpp.
void image_segmentation_demo::ROSImageTexture::clear | ( | void | ) |
Definition at line 59 of file ros_image_texture.cpp.
uint32_t image_segmentation_demo::ROSImageTexture::getHeight | ( | ) | [inline] |
Definition at line 82 of file ros_image_texture.h.
const Ogre::TexturePtr& image_segmentation_demo::ROSImageTexture::getTexture | ( | ) | [inline] |
Definition at line 78 of file ros_image_texture.h.
uint32_t image_segmentation_demo::ROSImageTexture::getWidth | ( | ) | [inline] |
Definition at line 81 of file ros_image_texture.h.
void image_segmentation_demo::ROSImageTexture::setNewImage | ( | sensor_msgs::Image::Ptr | new_image_ | ) |
Definition at line 75 of file ros_image_texture.cpp.
Definition at line 84 of file ros_image_texture.cpp.
void image_segmentation_demo::ROSImageTexture::setTopic | ( | const std::string & | topic | ) |
bool image_segmentation_demo::ROSImageTexture::update | ( | void | ) |
Definition at line 92 of file ros_image_texture.cpp.
Definition at line 88 of file ros_image_texture.h.
Ogre::Image image_segmentation_demo::ROSImageTexture::empty_image_ [private] |
Definition at line 91 of file ros_image_texture.h.
Definition at line 94 of file ros_image_texture.h.
Definition at line 95 of file ros_image_texture.h.
Ogre::TexturePtr image_segmentation_demo::ROSImageTexture::texture_ [private] |
Definition at line 90 of file ros_image_texture.h.
Definition at line 93 of file ros_image_texture.h.