Skip to content

Commit

Permalink
Style
Browse files Browse the repository at this point in the history
Signed-off-by: Stephen Brawner <brawner@gmail.com>
  • Loading branch information
brawner committed Oct 28, 2020
1 parent 7426e7f commit daee715
Show file tree
Hide file tree
Showing 2 changed files with 5 additions and 5 deletions.
4 changes: 2 additions & 2 deletions rclcpp/test/benchmark/benchmark_client.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -27,7 +27,7 @@ class ClientPerformanceTest : public PerformanceTest
{
public:
explicit ClientPerformanceTest(rclcpp::NodeOptions = rclcpp::NodeOptions()) {}
void SetUp(::benchmark::State & state)
void SetUp(benchmark::State & state)
{
rclcpp::init(0, nullptr);
node = std::make_unique<rclcpp::Node>("node", "ns");
Expand All @@ -42,7 +42,7 @@ class ClientPerformanceTest : public PerformanceTest
performance_test_fixture::PerformanceTest::SetUp(state);
}

void TearDown(::benchmark::State & state)
void TearDown(benchmark::State & state)
{
performance_test_fixture::PerformanceTest::TearDown(state);
empty_service.reset();
Expand Down
6 changes: 3 additions & 3 deletions rclcpp/test/benchmark/benchmark_service.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -27,17 +27,17 @@ class ServicePerformanceTest : public PerformanceTest
public:
ServicePerformanceTest() : callback_count(0) {}

void SetUp(::benchmark::State & state)
void SetUp(benchmark::State & state)
{
rclcpp::init(0, nullptr);
node = std::make_unique<rclcpp::Node>("node", "ns");
empty_client = node->create_client<test_msgs::srv::Empty>(empty_service_name);
callback_count = 0;

performance_test_fixture::PerformanceTest::SetUp(state);
}

void TearDown(::benchmark::State & state)
void TearDown(benchmark::State & state)
{
performance_test_fixture::PerformanceTest::TearDown(state);

Expand Down

0 comments on commit daee715

Please sign in to comment.