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; }