Skip to content

Commit

Permalink
Merge pull request ros-industrial#21 from marip8/fix/goal_ik_solve
Browse files Browse the repository at this point in the history
Goal State IK Solve Bug Fix
  • Loading branch information
jrgnicho authored May 5, 2020
2 parents 2377bc2 + 64cdd98 commit 7fe40fb
Showing 1 changed file with 2 additions and 3 deletions.
5 changes: 2 additions & 3 deletions stomp_moveit/src/stomp_planner.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -409,9 +409,8 @@ bool StompPlanner::getSeedParameters(Eigen::MatrixXd& parameters) const
}

Eigen::VectorXd solution;
Eigen::VectorXd seed = start;
ik_solver_->setKinematicState(state);
if(ik_solver_->solve(seed,tool_constraints.get(),solution))
if(ik_solver_->solve(goal,tool_constraints.get(),solution))
{
goal = solution;
found_goal = true;
Expand Down Expand Up @@ -722,7 +721,7 @@ bool StompPlanner::canServiceRequest(const moveit_msgs::MotionPlanRequest &req)
// check that we have joint or cartesian constraints at the goal
const auto& gc = req.goal_constraints[0];
if ((gc.joint_constraints.size() == 0) &&
!utils::kinematics::isCartesianConstraints(gc))
!utils::kinematics::isCartesianConstraints(gc))
{
ROS_ERROR("STOMP couldn't find either a joint or cartesian goal.");
return false;
Expand Down

0 comments on commit 7fe40fb

Please sign in to comment.