Skip to content

Commit

Permalink
Fix docstring spacing in newly added trajectory Python bindings (#2471)
Browse files Browse the repository at this point in the history
  • Loading branch information
sea-bass committed Oct 24, 2023
1 parent faa4795 commit 19c58b8
Showing 1 changed file with 3 additions and 4 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -139,7 +139,7 @@ void init_robot_trajectory(py::module& m)
py::arg("velocity_scaling_factor"), py::arg("acceleration_scaling_factor"), py::kw_only(),
py::arg("path_tolerance") = 0.1, py::arg("resample_dt") = 0.1, py::arg("min_angle_change") = 0.001,
R"(
Adds time parameterization to the trajectory using the Time-Optimal Trajectory Generation (TOTG) algorithm.
Adds time parameterization to the trajectory using the Time-Optimal Trajectory Generation (TOTG) algorithm.
Args:
velocity_scaling_factor (float): The velocity scaling factor.
acceleration_scaling_factor (float): The acceleration scaling factor.
Expand All @@ -154,7 +154,7 @@ void init_robot_trajectory(py::module& m)
py::arg("acceleration_scaling_factor"), py::kw_only(), py::arg("mitigate_overshoot") = false,
py::arg("overshoot_threshold") = 0.01,
R"(
Applies Ruckig smoothing to the trajectory.
Applies Ruckig smoothing to the trajectory.
Args:
velocity_scaling_factor (float): The velocity scaling factor.
acceleration_scaling_factor (float): The acceleration scaling factor.
Expand All @@ -168,8 +168,7 @@ void init_robot_trajectory(py::module& m)
py::arg("joint_filter") = std::vector<std::string>(),
R"(
Get the trajectory as a moveit_msgs.msg.RobotTrajectory message.
Returns:
Returns:
moveit_msgs.msg.RobotTrajectory: A ROS robot trajectory message.
)")
.def("set_robot_trajectory_msg", &moveit_py::bind_robot_trajectory::set_robot_trajectory_msg,
Expand Down

0 comments on commit 19c58b8

Please sign in to comment.