Skip to content

Commit

Permalink
Fixes
Browse files Browse the repository at this point in the history
Signed-off-by: Jakubach <[email protected]>
  • Loading branch information
Jakubach committed Jan 23, 2025
1 parent 4f367af commit 5dcab94
Showing 1 changed file with 0 additions and 12 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -67,18 +67,6 @@ class Controller
const geometry_msgs::msg::Pose & pose, geometry_msgs::msg::Twist & cmd, bool is_docking,
bool backward = false);

protected:
/**
* @brief Check if a trajectory is collision free.
*
* @param target_pose Target pose, in robot centric coordinates.
* @param is_docking If true, robot is docking. If false, robot is undocking.
* @param backward If true, robot will drive backwards to goal.
* @return True if trajectory is collision free.
*/
bool isTrajectoryCollisionFree(
const geometry_msgs::msg::Pose & target_pose, bool is_docking, bool backward = false);

/**
* @brief Perform a command for in-place rotation.
* @param angular_distance_to_heading Angular distance to goal
Expand Down

0 comments on commit 5dcab94

Please sign in to comment.