Go to the documentation of this file.
37 #ifndef JSK_RVIZ_PLUGINS_CAMERA_INFO_DISPLAY_H_
38 #define JSK_RVIZ_PLUGINS_CAMERA_INFO_DISPLAY_H_
49 #include <OGRE/OgreSceneNode.h>
51 #include <sensor_msgs/Image.h>
52 #include <OGRE/OgreManualObject.h>
53 #include <OGRE/OgreSceneManager.h>
54 #include <OGRE/OgreTextureManager.h>
55 #include <OGRE/OgreTexture.h>
56 #include <OGRE/OgreTechnique.h>
69 #if ROS_VERSION_MINIMUM(1,12,0)
70 typedef std::shared_ptr<TrianglePolygon>
Ptr;
75 Ogre::SceneNode* node,
79 const std::string& name,
80 const Ogre::ColourValue& color,
91 class CameraInfoDisplay:
96 #if ROS_VERSION_MINIMUM(1,12,0)
97 typedef std::shared_ptr<rviz::Shape>
ShapePtr;
111 virtual void reset();
112 virtual void processMessage(
const sensor_msgs::CameraInfo::ConstPtr& msg);
116 virtual void update(
float wall_dt,
float ros_dt);
118 const sensor_msgs::CameraInfo::ConstPtr& camera_info);
120 const sensor_msgs::CameraInfo::ConstPtr& camera_info);
122 const cv::Point3d& point);
124 const cv::Point3d& O,
const cv::Point3d&
A,
const cv::Point3d& B, std::string name,
125 bool use_color,
bool upper_triangle);
128 virtual void imageCallback(
const sensor_msgs::Image::ConstPtr& msg);
134 std::vector<TrianglePolygon::Ptr>
polygons_;
rviz::BoolProperty * show_edges_property_
Ogre::ManualObject * manual_
ImageTransportHintsProperty * image_transport_hints_property_
virtual void subscribeImage(std::string topic)
boost::shared_ptr< rviz::Shape > ShapePtr
TrianglePolygon(Ogre::SceneManager *manager, Ogre::SceneNode *node, const cv::Point3d &O, const cv::Point3d &A, const cv::Point3d &B, const std::string &name, const Ogre::ColourValue &color, bool use_color, bool upper_triangle)
virtual void prepareMaterial()
void updateNotShowSidePolygons()
sensor_msgs::CameraInfo::ConstPtr camera_info_
void updateShowPolygons()
void updateFarClipDistance()
rviz::BoolProperty * use_image_property_
virtual ~CameraInfoDisplay()
image_transport::Subscriber image_sub_
std::vector< TrianglePolygon::Ptr > polygons_
virtual void createCameraInfoShapes(const sensor_msgs::CameraInfo::ConstPtr &camera_info)
virtual void addPointToEdge(const cv::Point3d &point)
virtual void drawImageTexture()
virtual void addPolygon(const cv::Point3d &O, const cv::Point3d &A, const cv::Point3d &B, std::string name, bool use_color, bool upper_triangle)
virtual bool isSameCameraInfo(const sensor_msgs::CameraInfo::ConstPtr &camera_info)
rviz::BoolProperty * show_polygons_property_
Ogre::MaterialPtr material_bottom_
Ogre::TexturePtr texture_
virtual ~TrianglePolygon()
virtual void update(float wall_dt, float ros_dt)
double far_clip_distance_
virtual void imageCallback(const sensor_msgs::Image::ConstPtr &msg)
rviz::RosTopicProperty * image_topic_property_
rviz::ColorProperty * color_property_
bool not_show_side_polygons_
virtual void createTextureForBottom(int width, int height)
Ogre::SceneManager * manager_
Ogre::TexturePtr bottom_texture_
rviz::FloatProperty * far_clip_distance_property_
rviz::ColorProperty * edge_color_property_
Ogre::MaterialPtr material_
rviz::FloatProperty * alpha_property_
rviz::BoolProperty * not_show_side_polygons_property_
boost::shared_ptr< rviz::BillboardLine > BillboardLinePtr
boost::shared_ptr< TrianglePolygon > Ptr
virtual void processMessage(const sensor_msgs::CameraInfo::ConstPtr &msg)
virtual void onInitialize()
jsk_rviz_plugins
Author(s): Kei Okada
, Yohei Kakiuchi , Shohei Fujii , Ryohei Ueda
autogenerated on Fri Dec 13 2024 03:49:56