Skip to content

Commit 9365c17

Browse files
committed
Revert "Update reset documentation (#31)"
This reverts commit 8248d6c.
1 parent c40b7ca commit 9365c17

File tree

2 files changed

+2
-2
lines changed

2 files changed

+2
-2
lines changed

dwb_local_planner/README.md

+1-1
Original file line numberDiff line numberDiff line change
@@ -72,7 +72,7 @@ virtual bool isGoalReached(const geometry_msgs::Pose2D& query_pose, const geomet
7272

7373
* `void initialize(const ros::NodeHandle& planner_nh, std::string name, nav_core2::Costmap::Ptr costmap)` - called once on startup, and then calls `onInit`
7474
* `void onInit()` - May be overwritten to load parameters as needed.
75-
* `void reset()` - called at the beginning of every new navigation, i.e. when we get a new global goal via `setGoalPose`.
75+
* `void reset()` - called at the beginning of every new navigation, i.e. when we get a new global plan.
7676
* `bool prepare(const geometry_msgs::Pose2D& pose, const nav_2d_msgs::Twist2D& vel, const geometry_msgs::Pose2D& goal, const nav_2d_msgs::Path2D& global_plan)` - called once per iteration of the planner, prior to the evaluation of all the trajectories
7777
* `double scoreTrajectory(const dwb_msgs::Trajectory2D& traj)` - called once per trajectory
7878
* `void debrief(const nav_2d_msgs::Twist2D& cmd_vel)` - called after all the trajectories to notify what trajectory was chosen.

dwb_local_planner/include/dwb_local_planner/trajectory_critic.h

+1-1
Original file line numberDiff line numberDiff line change
@@ -104,7 +104,7 @@ class TrajectoryCritic
104104
/**
105105
* @brief Reset the state of the critic
106106
*
107-
* Reset is called when the planner receives a new global goal.
107+
* Reset is called when the planner receives a new global plan.
108108
* This can be used to discard information specific to one plan.
109109
*/
110110
virtual void reset() {}

0 commit comments

Comments
 (0)