#include <gazebo_state_plugins/GazeboMapPublisher.h>#include <gazebo_version_helpers/GazeboVersionHelpers.h>#include <gazebo/physics/physics.hh>#include <Eigen/Core>#include <shape_msgs/SolidPrimitive.h>#include <geometry_msgs/Pose.h>#include <nav_msgs/MapMetaData.h>#include <std_msgs/Float64.h>
Go to the source code of this file.
Classes | |
| class | gazebo::GazeboMapPublisher::CollisionMapRequest |
Defines | |
| #define | DEFAULT_MAP_PUB_FREQ "1" |
| #define | DEFAULT_REQUEST_MAP_SERVICE "dynamic_map" |
| #define | MAP_HEIGHT 1.0 |
| #define | MAP_LEN_X 20 |
| #define | MAP_LEN_Y 20 |
| #define | MAP_OFFSET_X -10 |
| #define | MAP_OFFSET_Y -10 |
| #define | MAP_QUEUE_SIZE 50 |
| #define | MAP_RESOLUTION 0.1 |
| #define | MAX_MAP_VAL 100 |
| #define | MSG_PRINT(o) std::cout<<o<<std::endl; |
| #define DEFAULT_MAP_PUB_FREQ "1" |
Definition at line 17 of file GazeboMapPublisher.cpp.
| #define DEFAULT_REQUEST_MAP_SERVICE "dynamic_map" |
Definition at line 14 of file GazeboMapPublisher.cpp.
| #define MAP_HEIGHT 1.0 |
Definition at line 27 of file GazeboMapPublisher.cpp.
| #define MAP_LEN_X 20 |
Definition at line 21 of file GazeboMapPublisher.cpp.
| #define MAP_LEN_Y 20 |
Definition at line 22 of file GazeboMapPublisher.cpp.
| #define MAP_OFFSET_X -10 |
Definition at line 19 of file GazeboMapPublisher.cpp.
| #define MAP_OFFSET_Y -10 |
Definition at line 20 of file GazeboMapPublisher.cpp.
| #define MAP_QUEUE_SIZE 50 |
Definition at line 29 of file GazeboMapPublisher.cpp.
| #define MAP_RESOLUTION 0.1 |
Definition at line 24 of file GazeboMapPublisher.cpp.
| #define MAX_MAP_VAL 100 |
Definition at line 34 of file GazeboMapPublisher.cpp.
| #define MSG_PRINT | ( | o | ) | std::cout<<o<<std::endl; |
Definition at line 31 of file GazeboMapPublisher.cpp.