From f74aa0d71e5016de8d039bf10b00ed36e14c1bd6 Mon Sep 17 00:00:00 2001 From: =?UTF-8?q?Alejandro=20Hern=C3=A1ndez=20Cordero?= Date: Mon, 22 Jan 2024 16:05:51 +0100 Subject: [PATCH] Review feedback MIME-Version: 1.0 Content-Type: text/plain; charset=UTF-8 Content-Transfer-Encoding: 8bit Signed-off-by: Alejandro Hernández Cordero --- image_proc/test/rostest.cpp | 2 +- image_proc/test/test_rectify.cpp | 2 +- 2 files changed, 2 insertions(+), 2 deletions(-) diff --git a/image_proc/test/rostest.cpp b/image_proc/test/rostest.cpp index 13ff804d7..f84594af0 100644 --- a/image_proc/test/rostest.cpp +++ b/image_proc/test/rostest.cpp @@ -50,7 +50,7 @@ class ImageProcTest protected: virtual void SetUp() { - node = rclcpp::Node::make_shared("image_proc_Test"); + node = rclcpp::Node::make_shared("image_proc_test"); // Determine topic names std::string camera_ns = node->get_node_topics_interface()->resolve_topic_name("camera") + "/"; diff --git a/image_proc/test/test_rectify.cpp b/image_proc/test/test_rectify.cpp index fd8c4bcf6..adf3dedaa 100644 --- a/image_proc/test/test_rectify.cpp +++ b/image_proc/test/test_rectify.cpp @@ -174,7 +174,7 @@ class ImageProcRectifyTest try { cv_ptr = cv_bridge::toCvShare(msg, sensor_msgs::image_encodings::BGR8); } catch (cv_bridge::Exception & e) { - RCLCPP_INFO(node->get_logger(), "cv_bridge exception: '%s'", e.what()); + RCLCPP_ERROR(node->get_logger(), "cv_bridge exception: '%s'", e.what()); return; }