Skip to content

Commit

Permalink
Address PR reviews
Browse files Browse the repository at this point in the history
  • Loading branch information
corot committed May 1, 2024
1 parent cac57b8 commit 3ca3c08
Showing 1 changed file with 2 additions and 0 deletions.
2 changes: 2 additions & 0 deletions costmap_2d/include/costmap_2d/footprint.h
Original file line number Diff line number Diff line change
Expand Up @@ -120,6 +120,8 @@ bool makeFootprintFromString(const std::string& footprint_string, std::vector<ge
/**
* @brief Read the ros-params "footprint" and/or "robot_radius" from
* the given NodeHandle using searchParam() to go up the tree.
* @return The footprint as a list of points and whether we used the robot_radius.
* I that's the case, the footprint will be a circle of "robot_radius".
*/
std::pair<std::vector<geometry_msgs::Point>, bool> makeFootprintFromParams(ros::NodeHandle& nh);

Expand Down

0 comments on commit 3ca3c08

Please sign in to comment.