toolbox_msgs.hpp
Go to the documentation of this file.
1 /*
2  * slam_toolbox
3  * Copyright (c) 2019, Steve Macenski
4  *
5  * THE WORK (AS DEFINED BELOW) IS PROVIDED UNDER THE TERMS OF THIS CREATIVE
6  * COMMONS PUBLIC LICENSE ("CCPL" OR "LICENSE"). THE WORK IS PROTECTED BY
7  * COPYRIGHT AND/OR OTHER APPLICABLE LAW. ANY USE OF THE WORK OTHER THAN AS
8  * AUTHORIZED UNDER THIS LICENSE OR COPYRIGHT LAW IS PROHIBITED.
9  *
10  * BY EXERCISING ANY RIGHTS TO THE WORK PROVIDED HERE, YOU ACCEPT AND AGREE TO
11  * BE BOUND BY THE TERMS OF THIS LICENSE. THE LICENSOR GRANTS YOU THE RIGHTS
12  * CONTAINED HERE IN CONSIDERATION OF YOUR ACCEPTANCE OF SUCH TERMS AND
13  * CONDITIONS.
14  *
15  */
16 
17 /* Author: Steven Macenski */
18 
19 #ifndef SLAM_TOOLBOX_TOOLBOX_MSGS_H_
20 #define SLAM_TOOLBOX_TOOLBOX_MSGS_H_
21 
22 #include <nav_msgs/MapMetaData.h>
23 #include <sensor_msgs/LaserScan.h>
24 #include <nav_msgs/GetMap.h>
25 #include <geometry_msgs/PoseWithCovarianceStamped.h>
26 
27 #include <visualization_msgs/MarkerArray.h>
28 #include <visualization_msgs/InteractiveMarker.h>
29 #include <visualization_msgs/InteractiveMarkerControl.h>
30 #include <visualization_msgs/InteractiveMarkerFeedback.h>
31 
32 #include "slam_toolbox_msgs/Pause.h"
33 #include "slam_toolbox_msgs/ClearQueue.h"
34 #include "slam_toolbox_msgs/ToggleInteractive.h"
35 #include "slam_toolbox_msgs/Clear.h"
36 #include "slam_toolbox_msgs/ClearQueue.h"
37 #include "slam_toolbox_msgs/SaveMap.h"
38 #include "slam_toolbox_msgs/LoopClosure.h"
39 #include "slam_toolbox_msgs/SerializePoseGraph.h"
40 #include "slam_toolbox_msgs/DeserializePoseGraph.h"
41 #include "slam_toolbox_msgs/MergeMaps.h"
42 #include "slam_toolbox_msgs/AddSubmap.h"
43 
44 #endif //SLAM_TOOLBOX_TOOLBOX_MSGS_H_


slam_toolbox
Author(s): Steve Macenski
autogenerated on Thu Jan 11 2024 03:37:56