Skip to content

Commit ac961cb

Browse files
committed
header files changed for unit tests
1 parent 6d555a9 commit ac961cb

6 files changed

+29
-54
lines changed

io_gripper_controller/test/test_io_gripper_controller_all_param_set.cpp

Lines changed: 9 additions & 9 deletions
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
// Copyright (c) 2022, Stogl Robotics Consulting UG (haftungsbeschränkt)
1+
// Copyright (c) 2025, b»robotized by Stogl Robotics
22
//
33
// Licensed under the Apache License, Version 2.0 (the "License");
44
// you may not use this file except in compliance with the License.
@@ -12,31 +12,31 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
//
16-
// Source of this file are templates in
17-
// [RosTeamWorkspace](https://github.com/StoglRobotics/ros_team_workspace) repository.
18-
//
19-
20-
#include "rclcpp/rclcpp.hpp"
21-
#include "test_io_gripper_controller.hpp"
22-
2315
#include <limits>
2416
#include <memory>
2517
#include <string>
2618
#include <utility>
2719
#include <vector>
2820

21+
#include <rclcpp/rclcpp.hpp>
22+
#include "test_io_gripper_controller.hpp"
23+
2924
// Test setting all params and getting success
3025
TEST_F(IOGripperControllerTest, AllParamsSetSuccess)
3126
{
27+
RCLCPP_INFO(rclcpp::get_logger("IOGripperControllerTest"), "Setting all parameters");
3228
SetUpController();
29+
RCLCPP_INFO(rclcpp::get_logger("IOGripperControllerTest"), "Setting up controllers");
3330

3431
setup_parameters();
3532

33+
RCLCPP_INFO(rclcpp::get_logger("IOGripperControllerTest"), "Setup parameters successfully");
34+
3635
// configure success.
3736
ASSERT_EQ(
3837
controller_->on_configure(rclcpp_lifecycle::State()),
3938
controller_interface::CallbackReturn::SUCCESS);
39+
RCLCPP_INFO(rclcpp::get_logger("IOGripperControllerTest"), "Setup parameters successfully");
4040
}
4141

4242
// Test not setting the one param and getting failure

io_gripper_controller/test/test_io_gripper_controller_close.cpp

Lines changed: 4 additions & 9 deletions
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
// Copyright (c) 2022, Stogl Robotics Consulting UG (haftungsbeschränkt)
1+
// Copyright (c) 2025, b»robotized by Stogl Robotics
22
//
33
// Licensed under the Apache License, Version 2.0 (the "License");
44
// you may not use this file except in compliance with the License.
@@ -12,20 +12,15 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
//
16-
// Source of this file are templates in
17-
// [RosTeamWorkspace](https://github.com/StoglRobotics/ros_team_workspace) repository.
18-
//
19-
20-
#include "rclcpp/rclcpp.hpp"
21-
#include "test_io_gripper_controller.hpp"
22-
2315
#include <limits>
2416
#include <memory>
2517
#include <string>
2618
#include <utility>
2719
#include <vector>
2820

21+
#include <rclcpp/rclcpp.hpp>
22+
#include "test_io_gripper_controller.hpp"
23+
2924
// Test open gripper service sets command its as expected and publishes msg
3025
TEST_F(IOGripperControllerTest, CloseGripperService)
3126
{

io_gripper_controller/test/test_io_gripper_controller_open.cpp

Lines changed: 4 additions & 9 deletions
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
// Copyright (c) 2022, Stogl Robotics Consulting UG (haftungsbeschränkt)
1+
// Copyright (c) 2025, b»robotized by Stogl Robotics
22
//
33
// Licensed under the Apache License, Version 2.0 (the "License");
44
// you may not use this file except in compliance with the License.
@@ -12,20 +12,15 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
//
16-
// Source of this file are templates in
17-
// [RosTeamWorkspace](https://github.com/StoglRobotics/ros_team_workspace) repository.
18-
//
19-
20-
#include "rclcpp/rclcpp.hpp"
21-
#include "test_io_gripper_controller.hpp"
22-
2315
#include <limits>
2416
#include <memory>
2517
#include <string>
2618
#include <utility>
2719
#include <vector>
2820

21+
#include <rclcpp/rclcpp.hpp>
22+
#include "test_io_gripper_controller.hpp"
23+
2924
// Test open gripper service sets command its as expected and publishes msg
3025
TEST_F(IOGripperControllerTest, OpenGripperService)
3126
{

io_gripper_controller/test/test_io_gripper_controller_open_close_action.cpp

Lines changed: 4 additions & 9 deletions
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
// Copyright (c) 2022, Stogl Robotics Consulting UG (haftungsbeschränkt)
1+
// Copyright (c) 2025, b»robotized by Stogl Robotics
22
//
33
// Licensed under the Apache License, Version 2.0 (the "License");
44
// you may not use this file except in compliance with the License.
@@ -12,20 +12,15 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
//
16-
// Source of this file are templates in
17-
// [RosTeamWorkspace](https://github.com/StoglRobotics/ros_team_workspace) repository.
18-
//
19-
20-
#include "rclcpp/rclcpp.hpp"
21-
#include "test_io_gripper_controller.hpp"
22-
2315
#include <limits>
2416
#include <memory>
2517
#include <string>
2618
#include <utility>
2719
#include <vector>
2820

21+
#include <rclcpp/rclcpp.hpp>
22+
#include "test_io_gripper_controller.hpp"
23+
2924
// Test open gripper service sets command its as expected and publishes msg
3025
TEST_F(IOGripperControllerTest, OpenCloseGripperAction)
3126
{

io_gripper_controller/test/test_io_gripper_controller_reconfigure.cpp

Lines changed: 4 additions & 9 deletions
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
// Copyright (c) 2022, Stogl Robotics Consulting UG (haftungsbeschränkt)
1+
// Copyright (c) 2025, b»robotized by Stogl Robotics
22
//
33
// Licensed under the Apache License, Version 2.0 (the "License");
44
// you may not use this file except in compliance with the License.
@@ -12,20 +12,15 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
//
16-
// Source of this file are templates in
17-
// [RosTeamWorkspace](https://github.com/StoglRobotics/ros_team_workspace) repository.
18-
//
19-
20-
#include "rclcpp/rclcpp.hpp"
21-
#include "test_io_gripper_controller.hpp"
22-
2315
#include <limits>
2416
#include <memory>
2517
#include <string>
2618
#include <utility>
2719
#include <vector>
2820

21+
#include <rclcpp/rclcpp.hpp>
22+
#include "test_io_gripper_controller.hpp"
23+
2924
// Test open gripper service sets command its as expected and publishes msg
3025
TEST_F(IOGripperControllerTest, ReconfigureGripperService)
3126
{

io_gripper_controller/test/test_io_gripper_controller_reconfigure_action.cpp

Lines changed: 4 additions & 9 deletions
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
// Copyright (c) 2022, Stogl Robotics Consulting UG (haftungsbeschränkt)
1+
// Copyright (c) 2025, b»robotized by Stogl Robotics
22
//
33
// Licensed under the Apache License, Version 2.0 (the "License");
44
// you may not use this file except in compliance with the License.
@@ -12,20 +12,15 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
//
16-
// Source of this file are templates in
17-
// [RosTeamWorkspace](https://github.com/StoglRobotics/ros_team_workspace) repository.
18-
//
19-
20-
#include "rclcpp/rclcpp.hpp"
21-
#include "test_io_gripper_controller.hpp"
22-
2315
#include <limits>
2416
#include <memory>
2517
#include <string>
2618
#include <utility>
2719
#include <vector>
2820

21+
#include <rclcpp/rclcpp.hpp>
22+
#include "test_io_gripper_controller.hpp"
23+
2924
// Test open gripper service sets command its as expected and publishes msg
3025
TEST_F(IOGripperControllerTest, ReconfigureGripperAction)
3126
{

0 commit comments

Comments
 (0)