Go to the documentation of this file.
   30 #ifndef RVIZ_CAMERA_DISPLAY_H 
   31 #define RVIZ_CAMERA_DISPLAY_H 
   38 #include <OgreMaterial.h> 
   39 #include <OgreRenderTargetListener.h> 
   40 #include <OgreSharedPtr.h> 
   42 #include <sensor_msgs/CameraInfo.h> 
   63 class RosTopicProperty;
 
   64 class DisplayGroupVisibilityProperty;
 
   80   void update(
float wall_dt, 
float ros_dt) 
override;
 
   81   void reset() 
override;
 
  109   void processMessage(
const sensor_msgs::Image::ConstPtr& msg) 
override;
 
  
void processMessage(const sensor_msgs::Image::ConstPtr &msg) override
Implement this to process the contents of a message.
void postRenderTargetUpdate(const Ogre::RenderTargetEvent &evt) override
void fixedFrameChanged() override
Called by setFixedFrame(). Override to respond to changes to fixed_frame_.
Ogre::MaterialPtr fg_material_
void preRenderTargetUpdate(const Ogre::RenderTargetEvent &evt) override
static const QString BACKGROUND
void onInitialize() override
Override this function to do subclass-specific initialization.
void processCamInfoMessage(const sensor_msgs::CameraInfo::ConstPtr &msg)
Ogre::SceneNode * fg_scene_node_
RenderPanel * render_panel_
Property specialized to enforce floating point max/min.
void subscribe() override
ROS topic management.
static const QString OVERLAY
boost::mutex caminfo_mutex_
void unsubscribe() override
~CameraDisplay() override
void onDisable() override
Derived classes override this to do the actual work of disabling themselves.
DisplayGroupVisibilityProperty * visibility_property_
void reset() override
Called to tell the display to clear its state.
Display subclass for subscribing and displaying to image messages.
FloatProperty * alpha_property_
ros::Subscriber caminfo_sub_
void update(float wall_dt, float ros_dt) override
Called periodically by the visualization manager.
Ogre::Rectangle2D * bg_screen_rect_
Ogre::MaterialPtr bg_material_
Ogre::Rectangle2D * fg_screen_rect_
static const QString BOTH
sensor_msgs::CameraInfo::ConstPtr current_caminfo_
void updateQueueSize() override
EnumProperty * image_position_property_
void onEnable() override
Derived classes override this to do the actual work of enabling themselves.
Ogre::SceneNode * bg_scene_node_
FloatProperty * zoom_property_
rviz
Author(s): Dave Hershberger, David Gossow, Josh Faust, William Woodall 
autogenerated on Sun May 4 2025 02:31:26