1 #ifndef MULTI_ROBOT_INFO_VISUAL_HPP 2 #define MULTI_ROBOT_INFO_VISUAL_HPP 16 #include <boost/circular_buffer.hpp> 19 #include <tuw_multi_robot_msgs/RobotInfo.h> 20 #include <geometry_msgs/PoseWithCovariance.h> 33 void setMessage(
const tuw_multi_robot_msgs::RobotInfoConstPtr _msg);
56 std::vector<rviz::Object *>
make_robot(Ogre::Vector3 &position, Ogre::Quaternion &orientation);
59 using internal_map_type = std::pair<std::string,boost::circular_buffer<geometry_msgs::PoseWithCovariance>>;
60 using map_type = std::map<std::string,boost::circular_buffer<geometry_msgs::PoseWithCovariance>>;
61 using map_iterator = std::map<std::string,boost::circular_buffer<geometry_msgs::PoseWithCovariance>>::iterator;
64 std::vector<std::string>
recycle();
void setScalePose(float scale)
Ogre::ColourValue color_variance_
recycle_map_type recycle_map_
ros::Time last_render_time_
std::vector< std::string > recycle()
void enableRobot(const std::string &rName)
void setMessage(const tuw_multi_robot_msgs::RobotInfoConstPtr _msg)
void resetKeepMeasurementsCount(const unsigned int c)
ros::Duration recycle_thresh_
virtual ~MultiRobotInfoVisual()
void disableRobot(const std::string &rName)
std::map< std::string, ros::Time > recycle_map_type
std::vector< rviz::Object * > make_robot(Ogre::Vector3 &position, Ogre::Quaternion &orientation)
void setColorPose(Ogre::ColourValue color)
std::set< std::string > disabled_robots_
void setFramePosition(const Ogre::Vector3 &_position)
Ogre::SceneNode * frame_node_
Ogre::ColourValue color_pose_
Ogre::SceneManager * scene_manager_
std::pair< std::string, boost::circular_buffer< geometry_msgs::PoseWithCovariance >> internal_map_type
MultiRobotInfoVisual(Ogre::SceneManager *_scene_manager, Ogre::SceneNode *_parent_node)
std::map< std::string, boost::circular_buffer< geometry_msgs::PoseWithCovariance >> map_type
std::map< std::string, boost::circular_buffer< geometry_msgs::PoseWithCovariance >>::iterator map_iterator
std::map< std::string, std::vector< rviz::Object * > > robot_renderings_map_
void resetDuration(const ros::Duration &ts)
ros::Duration render_dur_thresh_
void setFrameOrientation(const Ogre::Quaternion &orientation)