Skip to content

Commit f49e86f

Browse files
committed
style
Signed-off-by: William Woodall <[email protected]>
1 parent 575573f commit f49e86f

File tree

4 files changed

+8
-10
lines changed

4 files changed

+8
-10
lines changed

rclcpp/test/rclcpp/strategies/test_allocator_memory_strategy.cpp

Lines changed: 0 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -40,7 +40,6 @@ class TestWaitable : public rclcpp::Waitable
4040
{
4141
public:
4242
void add_to_wait_set(rcl_wait_set_t &) override
43-
4443
{
4544
if (!test_waitable_result) {
4645
throw std::runtime_error("TestWaitable add_to_wait_set failed");

rclcpp/test/rclcpp/wait_set_policies/test_storage_policy_common.cpp

Lines changed: 0 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -52,7 +52,6 @@ class TestWaitable : public rclcpp::Waitable
5252
: is_ready_(false), add_to_wait_set_(false) {}
5353

5454
void add_to_wait_set(rcl_wait_set_t &) override
55-
5655
{
5756
if (!add_to_wait_set_) {
5857
throw std::runtime_error("waitable unexpectedly failed to be added to wait set");

rclcpp/test/rclcpp/waitables/test_intra_process_waitable.cpp

Lines changed: 4 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -22,8 +22,8 @@
2222
class TestIntraProcessWaitable : public ::testing::Test
2323
{
2424
protected:
25-
static void SetUpTestCase() { rclcpp::init(0, nullptr); }
26-
static void TearDownTestCase() { rclcpp::shutdown(); }
25+
static void SetUpTestCase() {rclcpp::init(0, nullptr);}
26+
static void TearDownTestCase() {rclcpp::shutdown();}
2727
};
2828

2929
TEST_F(TestIntraProcessWaitable, test_that_waitable_stays_ready_after_second_wait) {
@@ -36,8 +36,8 @@ TEST_F(TestIntraProcessWaitable, test_that_waitable_stays_ready_after_second_wai
3636
auto pub = node->create_publisher<Empty>("test_topic", 10);
3737

3838
auto make_sub_intra_process_waitable_ready = [pub]() {
39-
pub->publish(Empty());
40-
};
39+
pub->publish(Empty());
40+
};
4141

4242
rclcpp::test::waitables::do_test_that_waitable_stays_ready_after_second_wait(
4343
sub->get_intra_process_waitable(),

rclcpp/test/rclcpp/waitables/waitable_test_helpers.hpp

Lines changed: 4 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -12,8 +12,8 @@
1212
// See the License for the specific language governing permissions and
1313
// limitations under the License.
1414

15-
#ifndef RCLCPP__TEST__RCLCPP__WAITABLES__WAITABLE_TEST_HELPERS_HPP_
16-
#define RCLCPP__TEST__RCLCPP__WAITABLES__WAITABLE_TEST_HELPERS_HPP_
15+
#ifndef RCLCPP__WAITABLES__WAITABLE_TEST_HELPERS_HPP_
16+
#define RCLCPP__WAITABLES__WAITABLE_TEST_HELPERS_HPP_
1717

1818
#include <gtest/gtest.h>
1919

@@ -104,7 +104,7 @@ do_test_that_waitable_stays_ready_after_second_wait(
104104
waitable->execute(waitable->take_data());
105105
auto wait_result = wait_set.wait(std::chrono::seconds(0));
106106
EXPECT_EQ(wait_result.kind(), rclcpp::WaitResultKind::Timeout)
107-
<< "wait set did not time out after the waitable should have no longer been ready";
107+
<< "wait set did not time out after the waitable should have no longer been ready";
108108
EXPECT_FALSE(waitable->is_ready(wait_set.get_rcl_wait_set()))
109109
<< "waitable was unexpectedly ready after a take_data and execute";
110110
}
@@ -114,4 +114,4 @@ do_test_that_waitable_stays_ready_after_second_wait(
114114
} // namespace test
115115
} // namespace rclcpp
116116

117-
#endif // RCLCPP__TEST__RCLCPP__WAITABLES__WAITABLE_TEST_HELPERS_HPP_
117+
#endif // RCLCPP__WAITABLES__WAITABLE_TEST_HELPERS_HPP_

0 commit comments

Comments
 (0)