Skip to content

Commit

Permalink
Remove wrong error code assignment
Browse files Browse the repository at this point in the history
  • Loading branch information
rhaschke committed Oct 17, 2023
1 parent be55ed9 commit 05803f8
Showing 1 changed file with 1 addition and 1 deletion.
Original file line number Diff line number Diff line change
Expand Up @@ -860,7 +860,7 @@ const moveit_msgs::msg::MoveItErrorCodes ompl_interface::ModelBasedPlanningConte
RCLCPP_DEBUG(LOGGER, "%s: Solving the planning problem once...", name_.c_str());
ob::PlannerTerminationCondition ptc = constructPlannerTerminationCondition(timeout, start);
registerTerminationCondition(ptc);
result.val = ompl_simple_setup_->solve(ptc) == ompl::base::PlannerStatus::EXACT_SOLUTION;
std::ignore = ompl_simple_setup_->solve(ptc);
last_plan_time_ = ompl_simple_setup_->getLastPlanComputationTime();
unregisterTerminationCondition();
// fill the result status code
Expand Down

0 comments on commit 05803f8

Please sign in to comment.