Go to the documentation of this file.
   29 #ifndef IMAGE_DISPLAY_BASE_H 
   30 #define IMAGE_DISPLAY_BASE_H 
   34 #ifndef Q_MOC_RUN // See: https://bugreports.qt-project.org/browse/QTBUG-22829 
   37 #include <sensor_msgs/Image.h> 
   49 #include "rviz/rviz_export.h" 
   71   void setTopic(
const QString& topic, 
const QString& 
datatype) 
override;
 
   75   virtual void updateTopic();
 
   78   virtual void updateQueueSize();
 
   84   void onInitialize() 
override;
 
   87   void reset() 
override;
 
   92     targetFrame_ = targetFrame;
 
  100   void fixedFrameChanged() 
override;
 
  105   void incomingMessage(
const sensor_msgs::Image::ConstPtr& msg);
 
  113   virtual void processMessage(
const sensor_msgs::Image::ConstPtr& msg) = 0;
 
  115   void scanForTransportSubscriberPlugins();
 
  117   boost::scoped_ptr<image_transport::ImageTransport> 
it_;
 
  138 #endif // IMAGE_DISPLAY_BASE_H 
  
void enableTFFilter(std::string &targetFrame)
Enabling TF filtering by defining a target frame.
Property specialized to provide getter for booleans.
BoolProperty * unreliable_property_
boost::shared_ptr< tf2_ros::MessageFilter< sensor_msgs::Image > > tf_filter_
boost::scoped_ptr< image_transport::ImageTransport > it_
Display subclass for subscribing and displaying to image messages.
boost::shared_ptr< image_transport::SubscriberFilter > sub_
RosTopicProperty * topic_property_
IntProperty * queue_size_property_
uint32_t messages_received_
EnumProperty * transport_property_
std::set< std::string > transport_plugin_types_
Property specialized to provide max/min enforcement for integers.
rviz
Author(s): Dave Hershberger, David Gossow, Josh Faust, William Woodall 
autogenerated on Sun May 4 2025 02:31:26