Skip to content

Commit

Permalink
Review feedback
Browse files Browse the repository at this point in the history
Signed-off-by: Alejandro Hernández Cordero <ahcorde@gmail.com>
  • Loading branch information
ahcorde committed Jan 22, 2024
1 parent b90741c commit f74aa0d
Show file tree
Hide file tree
Showing 2 changed files with 2 additions and 2 deletions.
2 changes: 1 addition & 1 deletion image_proc/test/rostest.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -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") + "/";
Expand Down
2 changes: 1 addition & 1 deletion image_proc/test/test_rectify.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -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;
}

Expand Down

0 comments on commit f74aa0d

Please sign in to comment.