Skip to content

Commit

Permalink
merged master->ros2
Browse files Browse the repository at this point in the history
  • Loading branch information
matlabbe committed Jan 4, 2024
2 parents 80ae448 + c70f9f1 commit 745f9fc
Show file tree
Hide file tree
Showing 2 changed files with 23 additions and 1 deletion.
2 changes: 1 addition & 1 deletion rtabmap_conversions/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -19,7 +19,7 @@ find_package(tf2 REQUIRED)
find_package(tf2_eigen REQUIRED)
find_package(tf2_geometry_msgs REQUIRED)

find_package(RTABMap 0.21.2 REQUIRED)
find_package(RTABMap 0.21.3 REQUIRED)

include_directories(
${CMAKE_CURRENT_SOURCE_DIR}/include
Expand Down
22 changes: 22 additions & 0 deletions rtabmap_util/include/rtabmap_util/MapsManager.h
Original file line number Diff line number Diff line change
Expand Up @@ -132,6 +132,24 @@ class MapsManager {
#if defined(WITH_GRID_MAP_ROS) and defined(RTABMAP_GRIDMAP)
rclcpp::Publisher<grid_map_msgs::msg::GridMap>::SharedPtr elevationMapPub_;
#endif
=======
ros::Publisher cloudMapPub_;
ros::Publisher cloudGroundPub_;
ros::Publisher cloudObstaclesPub_;
ros::Publisher projMapPub_;
ros::Publisher gridMapPub_;
ros::Publisher gridProbMapPub_;
ros::Publisher scanMapPub_;
ros::Publisher octoMapPubBin_;
ros::Publisher octoMapPubFull_;
ros::Publisher octoMapCloud_;
ros::Publisher octoMapFrontierCloud_;
ros::Publisher octoMapGroundCloud_;
ros::Publisher octoMapObstacleCloud_;
ros::Publisher octoMapEmptySpace_;
ros::Publisher octoMapProj_;
ros::Publisher elevationMapPub_;
>>>>>>> c70f9f1b14ead8f51ee724bd0b2c88ff091d74fa

std::map<int, rtabmap::Transform> assembledGroundPoses_;
std::map<int, rtabmap::Transform> assembledObstaclePoses_;
Expand All @@ -154,9 +172,13 @@ class MapsManager {
int octomapTreeDepth_;
bool octomapUpdated_;

<<<<<<< HEAD
#ifdef RTABMAP_GRIDMAP
rtabmap::GridMap * elevationMap_;
#endif
=======
rtabmap::GridMap * elevationMap_;
>>>>>>> c70f9f1b14ead8f51ee724bd0b2c88ff091d74fa
bool elevationMapUpdated_;

rtabmap::ParametersMap parameters_;
Expand Down

0 comments on commit 745f9fc

Please sign in to comment.