From 30d7eb269e61648fc5d79b741195b7ee9ea9c934 Mon Sep 17 00:00:00 2001 From: William Woodall Date: Mon, 16 Mar 2015 17:28:32 -0700 Subject: [PATCH] add a clarifying comment --- rclcpp/include/rclcpp/executors/multi_threaded_executor.hpp | 2 +- 1 file changed, 1 insertion(+), 1 deletion(-) diff --git a/rclcpp/include/rclcpp/executors/multi_threaded_executor.hpp b/rclcpp/include/rclcpp/executors/multi_threaded_executor.hpp index d8d9d498f0..9f70558be4 100644 --- a/rclcpp/include/rclcpp/executors/multi_threaded_executor.hpp +++ b/rclcpp/include/rclcpp/executors/multi_threaded_executor.hpp @@ -58,7 +58,7 @@ class MultiThreadedExecutor : public executor::Executor std::vector threads; { std::lock_guard wait_lock(wait_mutex_); - size_t thread_id_ = 1; + size_t thread_id_ = 1; // Use a _ suffix to avoid shadowing `rclcpp::thread_id` for (size_t i = number_of_threads_; i > 0; --i) { std::this_thread::sleep_for(std::chrono::milliseconds(100));