Skip to content

Commit

Permalink
Remove unnecessary debug prints
Browse files Browse the repository at this point in the history
  • Loading branch information
saikishor committed Oct 11, 2024
1 parent b724528 commit 2a346b8
Showing 1 changed file with 0 additions and 8 deletions.
8 changes: 0 additions & 8 deletions joint_limits/src/joint_limits_helpers.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -111,15 +111,7 @@ std::pair<double, double> compute_velocity_limits(
vel_limits.first = std::max(prev_command_vel.value() - delta_vel, vel_limits.first);
vel_limits.second = std::min(prev_command_vel.value() + delta_vel, vel_limits.second);
}
RCLCPP_DEBUG(
rclcpp::get_logger("joint_limiter_interface"),
"Joint velocity limits for joint '%s' are [%f, %f]", joint_name.c_str(), vel_limits.first,
vel_limits.second);
internal::check_and_swap_limits(vel_limits);
RCLCPP_DEBUG(
rclcpp::get_logger("joint_limiter_interface"),
"After swapping Joint velocity limits for joint '%s' are [%f, %f]", joint_name.c_str(),
vel_limits.first, vel_limits.second);
return vel_limits;
}

Expand Down

0 comments on commit 2a346b8

Please sign in to comment.