30 #include <OGRE/OgreSceneNode.h> 31 #include <OGRE/OgreSceneManager.h> 49 "Scale of the pose's pose.",
55 "Color to draw the pose's pose.",
59 "Color to draw the pose's variance.",
89 visual_->setScalePose ( scale );
95 visual_->setColorPose ( color );
101 visual_->setColorVariance ( color );
109 Ogre::Quaternion orientation;
110 Ogre::Vector3 position;
113 ROS_DEBUG (
"Error transforming from frame '%s' to frame '%s'",
114 msg->header.frame_id.c_str(), qPrintable (
fixed_frame_ ) );
120 visual_->setFramePosition ( position );
121 visual_->setFrameOrientation ( orientation );
void processMessage(const geometry_msgs::PoseWithCovarianceStamped::ConstPtr &msg)
DisplayContext * context_
virtual ~PoseWithCovarianceDisplay()
Ogre::ColourValue getOgreColor() const
Ogre::SceneNode * scene_node_
rviz::FloatProperty * property_scale_pose_
virtual void onInitialize()
virtual FrameManager * getFrameManager() const=0
void updateColorVariance()
PoseWithCovarianceDisplay()
virtual Ogre::SceneManager * getSceneManager() const=0
rviz::ColorProperty * property_color_pose_
virtual float getFloat() const
bool getTransform(const Header &header, Ogre::Vector3 &position, Ogre::Quaternion &orientation)
void onInitialize() override
rviz::ColorProperty * property_color_variance_
boost::shared_ptr< PoseWithCovarianceVisual > visual_
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)