17 #ifndef CARTOGRAPHER_RVIZ_SRC_SUBMAPS_DISPLAY_H_ 18 #define CARTOGRAPHER_RVIZ_SRC_SUBMAPS_DISPLAY_H_ 25 #include "cartographer_ros_msgs/SubmapList.h" 59 void reset()
override;
61 const ::cartographer_ros_msgs::SubmapList::ConstPtr& msg)
override;
62 void update(
float wall_dt,
float ros_dt)
override;
70 using Trajectory = std::pair<std::unique_ptr<::rviz::Property>,
71 std::vector<std::unique_ptr<DrawableSubmap>>>;
73 ::cartographer::common::Mutex
mutex_;
80 #endif // CARTOGRAPHER_RVIZ_SRC_SUBMAPS_DISPLAY_H_
::rviz::Property * submaps_category_
~SubmapsDisplay() override
::cartographer::common::Mutex mutex_
::rviz::StringProperty * tracking_frame_property_
::tf2_ros::Buffer tf_buffer_
std::vector< Trajectory > trajectories_ GUARDED_BY(mutex_)
void processMessage(const ::cartographer_ros_msgs::SubmapList::ConstPtr &msg) override
SubmapsDisplay & operator=(const SubmapsDisplay &)=delete
std::pair< std::unique_ptr<::rviz::Property >, std::vector< std::unique_ptr< DrawableSubmap >>> Trajectory
::rviz::StringProperty * submap_query_service_property_
::tf2_ros::TransformListener tf_listener_
::rviz::StringProperty * map_frame_property_
::rviz::BoolProperty * visibility_all_enabled_
void onInitialize() override
void update(float wall_dt, float ros_dt) override
ros::ServiceClient client_