Skip to content

Commit 0067638

Browse files
committed
Fix whitespaces
1 parent 209d67d commit 0067638

File tree

3 files changed

+4
-7
lines changed

3 files changed

+4
-7
lines changed

kinematics_interface/include/kinematics_interface/kinematics_interface.hpp

+1-1
Original file line numberDiff line numberDiff line change
@@ -40,7 +40,7 @@ class KinematicsInterface
4040
/**
4141
* \brief Initialize plugin. This method must be called before any other.
4242
* \param[in] robot_description robot URDF in string format
43-
* \param[in] parameters_interface
43+
* \param[in] parameters_interface
4444
* \param[in] param_namespace namespace for kinematics parameters - defaults to "kinematics"
4545
* \return true if successful
4646
*/

kinematics_interface_kdl/src/kinematics_interface_kdl.cpp

+2-4
Original file line numberDiff line numberDiff line change
@@ -27,7 +27,7 @@ bool KinematicsInterfaceKDL::initialize(
2727
{
2828
// track initialization plugin
2929
initialized = true;
30-
30+
3131
// get parameters
3232
std::string ns = !param_namespace.empty() ? param_namespace + "." : "";
3333

@@ -64,13 +64,11 @@ bool KinematicsInterfaceKDL::initialize(
6464
}
6565
else
6666
{
67-
RCLCPP_ERROR(
68-
LOGGER, "Failed to find end effector name parameter [tip].");
67+
RCLCPP_ERROR(LOGGER, "Failed to find end effector name parameter [tip].");
6968
return false;
7069
}
7170
std::string end_effector_name = end_effector_name_param.as_string();
7271

73-
7472
// create kinematic chain
7573
KDL::Tree robot_tree;
7674
kdl_parser::treeFromString(robot_description_local, robot_tree);

kinematics_interface_kdl/test/test_kinematics_interface_kdl.cpp

+1-2
Original file line numberDiff line numberDiff line change
@@ -69,8 +69,7 @@ class TestKDLPlugin : public ::testing::Test
6969
* Elsewhere, `end_effector_` member is used.
7070
*/
7171
void loadTipParameter()
72-
{
73-
72+
{
7473
rclcpp::Parameter param("tip", "link2");
7574
node_->declare_parameter("tip", "link2");
7675
node_->set_parameter(param);

0 commit comments

Comments
 (0)