There was an error while loading. Please reload this page.
1 parent 4234a6e commit 89bceb7Copy full SHA for 89bceb7
nav2_costmap_2d/include/nav2_costmap_2d/costmap_2d_ros.hpp
@@ -294,6 +294,14 @@ class Costmap2DROS : public nav2_util::LifecycleNode
294
*/
295
bool getUseRadius() {return use_radius_;}
296
297
+ /**
298
+ * @brief Get the costmap's robot_radius_ parameter, corresponding to
299
+ * raidus of the robot footprint when it is defined as as circle
300
+ * (i.e. when use_radius_ == true).
301
+ * @return robot_radius_
302
+ */
303
+ double getRobotRadius() {return robot_radius_;}
304
+
305
protected:
306
rclcpp::Node::SharedPtr client_node_;
307
0 commit comments