Skip to content

Commit

Permalink
Slight fix to TOPPRA comments
Browse files Browse the repository at this point in the history
  • Loading branch information
sea-bass committed Oct 15, 2024
1 parent 5fa9878 commit 2768787
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 3 deletions.
2 changes: 1 addition & 1 deletion README.md
Original file line number Diff line number Diff line change
Expand Up @@ -10,7 +10,7 @@ This allows the user to setup motion planning as an optimization problem within
## Features

- Exposes [`KinematicTrajectoryOptimization`](https://drake.mit.edu/doxygen_cxx/classdrake_1_1planning_1_1trajectory__optimization_1_1_kinematic_trajectory_optimization.html) implementation in `drake` as a motion planner.
- Exposes [`TOPPRA`](https://drake.mit.edu/doxygen_cxx/classdrake_1_1multibody_1_1_toppra.html) implementation in `drake` as a trajectory post-processor.
- Exposes [`TOPPRA`](https://drake.mit.edu/doxygen_cxx/classdrake_1_1multibody_1_1_toppra.html) implementation in `drake` as a trajectory post-processing adapter.

## Docker Workflow (Preferred and tested)

Expand Down
4 changes: 2 additions & 2 deletions src/add_toppra_time_parameterization.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -83,7 +83,7 @@ rclcpp::Logger getLogger()
}
} // namespace
/**
* @brief Post-processing adapter that timeparametermizes a trajectory based on reachability analysis. For details see
* @brief Post-processing adapter that time-parameterizes a trajectory based on reachability analysis. For details see
* https://drake.mit.edu/doxygen_cxx/classdrake_1_1multibody_1_1_toppra.html
*
*/
Expand Down Expand Up @@ -152,7 +152,7 @@ class AddToppraTimeParameterization : public planning_interface::PlanningRespons
return;
}

// Update plan from planning scene
// Update Drake plant from MoveIt planning scene
auto& plant = diagram_->GetDowncastSubsystemByName<MultibodyPlant<double>>("plant");
auto& plant_context = diagram_->GetMutableSubsystemContext(plant, diagram_context_.get());
Eigen::VectorXd q = Eigen::VectorXd::Zero(plant.num_positions() + plant.num_velocities());
Expand Down

0 comments on commit 2768787

Please sign in to comment.