Skip to content

Commit 3ac190e

Browse files
authored
Update kinematics_interface_kdl/include/kinematics_interface_kdl/kinematics_interface_kdl.hpp
1 parent c59d396 commit 3ac190e

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

kinematics_interface_kdl/include/kinematics_interface_kdl/kinematics_interface_kdl.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -42,7 +42,7 @@ class KinematicsInterfaceKDL : public kinematics_interface::KinematicsInterface
4242
bool initialize(
4343
const std::string & robot_description,
4444
std::shared_ptr<rclcpp::node_interfaces::NodeParametersInterface> parameters_interface,
45-
const std::string & param_namespace = "kinematics") override;
45+
const std::string & param_namespace) override;
4646

4747
bool convert_cartesian_deltas_to_joint_deltas(
4848
const Eigen::VectorXd & joint_pos, const Eigen::Matrix<double, 6, 1> & delta_x,

0 commit comments

Comments
 (0)