Skip to content

Commit

Permalink
clang-tidy fixup (#1586)
Browse files Browse the repository at this point in the history
  • Loading branch information
v4hn authored and rhaschke committed Jul 31, 2019
1 parent 3cb561d commit bc45aec
Showing 1 changed file with 1 addition and 1 deletion.
Original file line number Diff line number Diff line change
Expand Up @@ -486,7 +486,7 @@ class MoveGroupInterfaceWrapper : protected py_bindings_tools::ROScppInitializer

std::string retimeTrajectory(const std::string& ref_state_str, const std::string& traj_str,
double velocity_scaling_factor, double acceleration_scaling_factor,
std::string algorithm)
const std::string& algorithm)
{
// Convert reference state message to object
moveit_msgs::RobotState ref_state_msg;
Expand Down

0 comments on commit bc45aec

Please sign in to comment.