Skip to content

Commit

Permalink
Edit docs and rename puts to inserts
Browse files Browse the repository at this point in the history
Signed-off-by: methylDragon <[email protected]>
  • Loading branch information
methylDragon committed Jul 31, 2024
1 parent e60ddbe commit c30831b
Show file tree
Hide file tree
Showing 5 changed files with 272 additions and 256 deletions.
4 changes: 2 additions & 2 deletions moveit_ros/trajectory_cache/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -66,10 +66,10 @@ if (fetched_trajectory)
else
{
// Plan... And put it for posterity!
traj_cache->putTrajectory(
traj_cache->insertTrajectory(
*interface, robot_name, std::move(plan_req_msg), std::move(res->result.trajectory),
rclcpp::Duration(res->result.trajectory.joint_trajectory.points.back().time_from_start).seconds(),
res->result.planning_time, /*delete_worse_trajectories=*/true);
res->result.planning_time, /*prune_worse_trajectories=*/true);
}
```
Expand Down
Loading

0 comments on commit c30831b

Please sign in to comment.