#include <ros_image_texture.h>
Public Member Functions | |
void | clear () |
void | getAvailableTransportTypes (V_string &types) |
uint32_t | getHeight () |
const sensor_msgs::Image::ConstPtr & | getImage () |
uint32_t | getImageCount () |
image_transport::ImageTransport & | getImageTransport () |
int | getQueueSize () |
const Ogre::TexturePtr & | getTexture () |
const std::string & | getTransportType () |
uint32_t | getWidth () |
ROSImageTexture (const ros::NodeHandle &nh) | |
void | setFrame (const std::string &frame, tf::TransformListener *tf_client) |
void | setQueueSize (int size) |
void | setTopic (const std::string &topic) |
void | setTransportType (const std::string &transport_type) |
bool | update () |
~ROSImageTexture () | |
Private Member Functions | |
void | callback (const sensor_msgs::Image::ConstPtr &image) |
void | scanForTransportSubscriberPlugins () |
Private Attributes | |
sensor_msgs::Image::ConstPtr | current_image_ |
Ogre::Image | empty_image_ |
std::string | frame_ |
uint32_t | height_ |
uint32_t | image_count_ |
image_transport::ImageTransport | it_ |
boost::mutex | mutex_ |
bool | new_image_ |
ros::NodeHandle | nh_ |
int | queue_size_ |
boost::shared_ptr < image_transport::SubscriberFilter > | sub_ |
Ogre::TexturePtr | texture_ |
tf::TransformListener * | tf_client_ |
boost::shared_ptr < tf::MessageFilter < sensor_msgs::Image > > | tf_filter_ |
std::string | topic_ |
std::set< std::string > | transport_plugin_types_ |
std::string | transport_type_ |
uint32_t | width_ |
Definition at line 67 of file ros_image_texture.h.
rviz::ROSImageTexture::ROSImageTexture | ( | const ros::NodeHandle & | nh | ) |
Definition at line 52 of file ros_image_texture.cpp.
Definition at line 73 of file ros_image_texture.cpp.
void rviz::ROSImageTexture::callback | ( | const sensor_msgs::Image::ConstPtr & | image | ) | [private] |
Definition at line 334 of file ros_image_texture.cpp.
void rviz::ROSImageTexture::clear | ( | void | ) |
Definition at line 78 of file ros_image_texture.cpp.
void rviz::ROSImageTexture::getAvailableTransportTypes | ( | V_string & | types | ) |
Definition at line 138 of file ros_image_texture.cpp.
uint32_t rviz::ROSImageTexture::getHeight | ( | ) | [inline] |
Definition at line 82 of file ros_image_texture.h.
const sensor_msgs::Image::ConstPtr & rviz::ROSImageTexture::getImage | ( | ) |
Definition at line 173 of file ros_image_texture.cpp.
uint32_t rviz::ROSImageTexture::getImageCount | ( | ) | [inline] |
Definition at line 83 of file ros_image_texture.h.
Definition at line 85 of file ros_image_texture.h.
Definition at line 189 of file ros_image_texture.cpp.
const Ogre::TexturePtr& rviz::ROSImageTexture::getTexture | ( | ) | [inline] |
Definition at line 78 of file ros_image_texture.h.
const std::string& rviz::ROSImageTexture::getTransportType | ( | ) | [inline] |
Definition at line 88 of file ros_image_texture.h.
uint32_t rviz::ROSImageTexture::getWidth | ( | ) | [inline] |
Definition at line 81 of file ros_image_texture.h.
void rviz::ROSImageTexture::scanForTransportSubscriberPlugins | ( | ) | [private] |
Definition at line 343 of file ros_image_texture.cpp.
void rviz::ROSImageTexture::setFrame | ( | const std::string & | frame, |
tf::TransformListener * | tf_client | ||
) |
Definition at line 96 of file ros_image_texture.cpp.
void rviz::ROSImageTexture::setQueueSize | ( | int | size | ) |
Set the message filter queue size.
Definition at line 180 of file ros_image_texture.cpp.
void rviz::ROSImageTexture::setTopic | ( | const std::string & | topic | ) |
Definition at line 103 of file ros_image_texture.cpp.
void rviz::ROSImageTexture::setTransportType | ( | const std::string & | transport_type | ) |
Definition at line 132 of file ros_image_texture.cpp.
Definition at line 194 of file ros_image_texture.cpp.
sensor_msgs::Image::ConstPtr rviz::ROSImageTexture::current_image_ [private] |
Definition at line 107 of file ros_image_texture.h.
Ogre::Image rviz::ROSImageTexture::empty_image_ [private] |
Definition at line 112 of file ros_image_texture.h.
std::string rviz::ROSImageTexture::frame_ [private] |
Definition at line 118 of file ros_image_texture.h.
uint32_t rviz::ROSImageTexture::height_ [private] |
Definition at line 115 of file ros_image_texture.h.
uint32_t rviz::ROSImageTexture::image_count_ [private] |
Definition at line 121 of file ros_image_texture.h.
Definition at line 101 of file ros_image_texture.h.
boost::mutex rviz::ROSImageTexture::mutex_ [private] |
Definition at line 108 of file ros_image_texture.h.
bool rviz::ROSImageTexture::new_image_ [private] |
Definition at line 109 of file ros_image_texture.h.
ros::NodeHandle rviz::ROSImageTexture::nh_ [private] |
Definition at line 100 of file ros_image_texture.h.
int rviz::ROSImageTexture::queue_size_ [private] |
Definition at line 122 of file ros_image_texture.h.
boost::shared_ptr<image_transport::SubscriberFilter> rviz::ROSImageTexture::sub_ [private] |
Definition at line 102 of file ros_image_texture.h.
Ogre::TexturePtr rviz::ROSImageTexture::texture_ [private] |
Definition at line 111 of file ros_image_texture.h.
Definition at line 119 of file ros_image_texture.h.
boost::shared_ptr<tf::MessageFilter<sensor_msgs::Image> > rviz::ROSImageTexture::tf_filter_ [private] |
Definition at line 103 of file ros_image_texture.h.
std::string rviz::ROSImageTexture::topic_ [private] |
Definition at line 117 of file ros_image_texture.h.
std::set<std::string> rviz::ROSImageTexture::transport_plugin_types_ [private] |
Definition at line 124 of file ros_image_texture.h.
std::string rviz::ROSImageTexture::transport_type_ [private] |
Definition at line 105 of file ros_image_texture.h.
uint32_t rviz::ROSImageTexture::width_ [private] |
Definition at line 114 of file ros_image_texture.h.