Skip to content

Commit

Permalink
Clarified longest_valid_segment, also talked about max_waypoint_dist. (
Browse files Browse the repository at this point in the history
…#165)

* Clarified longest_valid_segment, also talked about max_waypoint_dist.

* Fixed one of the travis warnings.
  • Loading branch information
BryceStevenWilley authored and davetcoleman committed May 15, 2018
1 parent 1cbe76c commit 12131d6
Showing 1 changed file with 7 additions and 7 deletions.
14 changes: 7 additions & 7 deletions doc/kinematic_model/src/kinematic_model_tutorial.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -123,13 +123,13 @@ int main(int argc, char** argv)

// Inverse Kinematics
// ^^^^^^^^^^^^^^^^^^
// We can now solve inverse kinematics (IK) for the arm of the
// Panda robot. To solve IK, we will need the following:
// We can now solve inverse kinematics (IK) for the Panda robot.
// To solve IK, we will need the following:
//
// * The desired pose of the end-effector (by default, this is the last link in the "panda_arm" chain):
// end_effector_state that we computed in the step above.
// * The number of attempts to be made at solving IK: 10
// * The timeout for each attempt: 0.1 s
// * The desired pose of the end-effector (by default, this is the last link in the "panda_arm" chain):
// end_effector_state that we computed in the step above.
// * The number of attempts to be made at solving IK: 10
// * The timeout for each attempt: 0.1 s
std::size_t attempts = 10;
double timeout = 0.1;
bool found_ik = kinematic_state->setFromIK(joint_model_group, end_effector_state, attempts, timeout);
Expand Down Expand Up @@ -161,4 +161,4 @@ int main(int argc, char** argv)

ros::shutdown();
return 0;
}
}

0 comments on commit 12131d6

Please sign in to comment.