Skip to content

Commit

Permalink
run pre-commit
Browse files Browse the repository at this point in the history
  • Loading branch information
tpoignonec committed Sep 16, 2023
1 parent ac5e71b commit 75f6226
Showing 1 changed file with 1 addition and 2 deletions.
3 changes: 1 addition & 2 deletions kinematics_interface/src/kinematics_interface.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -22,7 +22,6 @@ namespace kinematics_interface

rclcpp::Logger LOGGER = rclcpp::get_logger("kinematics_interface");


bool KinematicsInterface::convert_cartesian_deltas_to_joint_deltas(
std::vector<double> & joint_pos_vec, const std::vector<double> & delta_x_vec,
const std::string & link_name, std::vector<double> & delta_theta_vec)
Expand Down Expand Up @@ -81,4 +80,4 @@ bool KinematicsInterface::calculate_jacobian(
return calculate_jacobian(joint_pos, link_name, jacobian);
}

} // namespace kinematics_interface
} // namespace kinematics_interface

0 comments on commit 75f6226

Please sign in to comment.