Skip to content

Commit

Permalink
Update docstring
Browse files Browse the repository at this point in the history
  • Loading branch information
christophfroehlich authored Dec 18, 2024
1 parent 44a8734 commit 3d3bb50
Showing 1 changed file with 2 additions and 2 deletions.
4 changes: 2 additions & 2 deletions include/control_toolbox/pid.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -90,12 +90,12 @@ namespace control_toolbox
\verbatim
control_toolbox::Pid pid;
pid.initialize(6.0, 1.0, 2.0, 0.3, -0.3);
double position_desi_ = 0.5;
double position_desi = 0.5;
...
rclcpp::Time last_time = get_clock()->now();
while (true) {
rclcpp::Time time = get_clock()->now();
double effort = pid.computeCommand(position_desi_ - currentPosition(), (time - last_time));
double effort = pid.compute_command(position_desi - currentPosition(), time - last_time);
last_time = time;
}
\endverbatim
Expand Down

0 comments on commit 3d3bb50

Please sign in to comment.