30 #ifndef POSE_WITH_COVARIANCE_VISUAL_H 31 #define POSE_WITH_COVARIANCE_VISUAL_H 33 #include <geometry_msgs/PoseWithCovarianceStamped.h> 64 void setMessage(
const geometry_msgs::PoseWithCovarianceStamped::ConstPtr& msg );
71 void setFramePosition(
const Ogre::Vector3& position );
72 void setFrameOrientation(
const Ogre::Quaternion& orientation );
76 void setScalePose(
float scale );
80 void setColorPose( Ogre::ColourValue color );
84 void setColorVariance( Ogre::ColourValue color );
113 #endif // POSE_WITH_COVARIANCE_VISUAL_H
boost::shared_ptr< rviz::Shape > variance_
Ogre::ColourValue color_pose_
boost::shared_ptr< rviz::Arrow > pose_
TFSIMD_FORCE_INLINE Vector3()
Ogre::ColourValue color_variance_
Ogre::SceneNode * frame_node_
Ogre::SceneManager * scene_manager_