Skip to content

Commit

Permalink
Remove debugging output in test
Browse files Browse the repository at this point in the history
  • Loading branch information
Martin-Idel-SI committed Aug 30, 2018
1 parent 725bf95 commit 45f1508
Showing 1 changed file with 0 additions and 1 deletion.
1 change: 0 additions & 1 deletion rosbag2/test/rosbag2/rosbag2_read_integration_test.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -45,7 +45,6 @@ class RosBag2IntegrationTestFixture : public Rosbag2TestFixture
auto node = std::make_shared<rclcpp::Node>("subscriber_node");
auto subscription = node->create_subscription<std_msgs::msg::String>("string_topic",
[this, &messages](const std_msgs::msg::String::ConstSharedPtr message) {
std::cout << "\ndata = " << message->data << "\n";
messages.emplace_back(message->data);
counter_++;
}, 10);
Expand Down

0 comments on commit 45f1508

Please sign in to comment.