35 #ifndef JSK_RVIZ_PLUGIN_OVERLAY_IMAGE_DISPLAY_H_ 36 #define JSK_RVIZ_PLUGIN_OVERLAY_IMAGE_DISPLAY_H_ 40 #include <OGRE/OgreTexture.h> 41 #include <OGRE/OgreColourValue.h> 42 #include <OGRE/OgreMaterial.h> 53 #include <sensor_msgs/Image.h> 89 #if ROS_VERSION_MINIMUM(1,12,0) 90 std::shared_ptr<image_transport::ImageTransport>
it_;
95 sensor_msgs::Image::ConstPtr
msg_;
105 virtual void update(
float wall_dt,
float ros_dt);
109 virtual void processMessage(
const sensor_msgs::Image::ConstPtr& msg);
rviz::FloatProperty * alpha_property_
sensor_msgs::Image::ConstPtr msg_
rviz::IntProperty * width_property_
rviz::BoolProperty * keep_aspect_ratio_property_
virtual void movePosition(int x, int y)
rviz::BoolProperty * overwrite_alpha_property_
OverlayObject::Ptr overlay_
virtual void setPosition(int x, int y)
void updateOverwriteAlpha()
rviz::IntProperty * height_property_
virtual bool isInRegion(int x, int y)
virtual void processMessage(const sensor_msgs::Image::ConstPtr &msg)
ImageTransportHintsProperty * transport_hint_property_
virtual void onInitialize()
virtual void unsubscribe()
virtual ~OverlayImageDisplay()
void updateKeepAspectRatio()
rviz::IntProperty * left_property_
virtual void setImageSize()
boost::shared_ptr< image_transport::ImageTransport > it_
image_transport::Subscriber sub_
rviz::IntProperty * top_property_
virtual void update(float wall_dt, float ros_dt)
rviz::RosTopicProperty * update_topic_property_