Skip to content

Commit 245bb50

Browse files
committed
style
Signed-off-by: William Woodall <[email protected]>
1 parent 2a88295 commit 245bb50

File tree

2 files changed

+6
-4
lines changed

2 files changed

+6
-4
lines changed

rclcpp/src/rclcpp/executor.cpp

Lines changed: 4 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -72,9 +72,10 @@ Executor::Executor(const rclcpp::ExecutorOptions & options)
7272
}
7373
});
7474

75-
notify_waitable_->set_on_ready_callback([this](auto, auto) {
76-
this->entities_need_rebuild_.store(true);
77-
});
75+
notify_waitable_->set_on_ready_callback(
76+
[this](auto, auto) {
77+
this->entities_need_rebuild_.store(true);
78+
});
7879

7980
notify_waitable_->add_guard_condition(interrupt_guard_condition_);
8081
notify_waitable_->add_guard_condition(shutdown_guard_condition_);

rclcpp/test/rclcpp/test_add_callback_groups_to_executor.cpp

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -202,7 +202,8 @@ TYPED_TEST(TestAddCallbackGroupsToExecutor, add_callback_groups_after_add_node_t
202202

203203
auto count_callback_groups_in_node = [](auto node) {
204204
size_t num = 0;
205-
node->get_node_base_interface()->for_each_callback_group([&num](auto) {
205+
node->get_node_base_interface()->for_each_callback_group(
206+
[&num](auto) {
206207
num++;
207208
});
208209
return num;

0 commit comments

Comments
 (0)