Skip to content

Commit

Permalink
Do not overwrite the error code with OMPL interface (#2725)
Browse files Browse the repository at this point in the history
In case of failure, set the error code to the one returned by the
planning pipeline's `solve` method rather than overwriting it with
`PLANNING_FAILED`.

Signed-off-by: Gaël Écorchard <[email protected]>
  • Loading branch information
galou authored Mar 5, 2024
1 parent aeb03f7 commit dafa36f
Showing 1 changed file with 2 additions and 5 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -802,12 +802,10 @@ void ModelBasedPlanningContext::solve(planning_interface::MotionPlanResponse& re
void ModelBasedPlanningContext::solve(planning_interface::MotionPlanDetailedResponse& res)
{
res.planner_id = request_.planner_id;
moveit_msgs::msg::MoveItErrorCodes moveit_result =
solve(request_.allowed_planning_time, request_.num_planning_attempts);
if (moveit_result.val != moveit_msgs::msg::MoveItErrorCodes::SUCCESS)
res.error_code = solve(request_.allowed_planning_time, request_.num_planning_attempts);
if (res.error_code.val != moveit_msgs::msg::MoveItErrorCodes::SUCCESS)
{
RCLCPP_INFO(getLogger(), "Unable to solve the planning problem");
res.error_code.val = moveit_msgs::msg::MoveItErrorCodes::PLANNING_FAILED;
return;
}

Expand Down Expand Up @@ -845,7 +843,6 @@ void ModelBasedPlanningContext::solve(planning_interface::MotionPlanDetailedResp

RCLCPP_DEBUG(getLogger(), "%s: Returning successful solution with %lu states", getName().c_str(),
getOMPLSimpleSetup()->getSolutionPath().getStateCount());
res.error_code.val = moveit_result.val;
}

const moveit_msgs::msg::MoveItErrorCodes ModelBasedPlanningContext::solve(double timeout, unsigned int count)
Expand Down

0 comments on commit dafa36f

Please sign in to comment.