Skip to content

Commit

Permalink
Update lerp_interface.cpp
Browse files Browse the repository at this point in the history
  • Loading branch information
mosfet80 authored Aug 9, 2024
1 parent d7da57a commit 939475f
Showing 1 changed file with 1 addition and 1 deletion.
Original file line number Diff line number Diff line change
Expand Up @@ -72,7 +72,7 @@ bool LERPInterface::solve(const planning_scene::PlanningSceneConstPtr& planning_
std::vector<double> start_joint_values;
start_state->copyJointGroupPositions(joint_model_group, start_joint_values);

// This planner only supports one goal constriant in the request
// This planner only supports one goal constraint in the request
std::vector<moveit_msgs::Constraints> goal_constraints = req.goal_constraints;
std::vector<moveit_msgs::JointConstraint> goal_joint_constraint = goal_constraints[0].joint_constraints;

Expand Down

0 comments on commit 939475f

Please sign in to comment.