Skip to content

Commit 27672e5

Browse files
fergian94rhaschke
authored andcommitted
Use a collision-free goal pose for LERP tutorial (#701)
1 parent be5dc9f commit 27672e5

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

doc/creating_moveit_plugins/lerp_motion_planner/src/lerp_example.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -107,7 +107,7 @@ int main(int argc, char** argv)
107107
req.start_state.joint_state.position = start_joint_values;
108108

109109
// Goal constraint
110-
std::vector<double> goal_joint_values = { 0.8, 0.7, 1, 1.3, 1.9, 2.2, 3 };
110+
std::vector<double> goal_joint_values = { 0.0, 0.0, 0.0, -M_PI_2, 0.0, M_PI_2, M_PI_4 };
111111
robot_state->setJointGroupPositions(joint_model_group, goal_joint_values);
112112
robot_state->update();
113113
moveit_msgs::Constraints joint_goal =

0 commit comments

Comments
 (0)