Skip to content

Commit

Permalink
Switch StaticSingleThreadedExecutor to SingleThreadedExecutor
Browse files Browse the repository at this point in the history
  • Loading branch information
sea-bass committed Nov 29, 2024
1 parent 1404825 commit 3c88f3d
Showing 1 changed file with 2 additions and 2 deletions.
4 changes: 2 additions & 2 deletions moveit_ros/warehouse/src/broadcast.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -42,7 +42,7 @@
#include <boost/program_options/options_description.hpp>
#include <boost/program_options/parsers.hpp>
#include <boost/program_options/variables_map.hpp>
#include <rclcpp/executors/static_single_threaded_executor.hpp>
#include <rclcpp/executors/single_threaded_executor.hpp>
#include <rclcpp/logger.hpp>
#include <rclcpp/logging.hpp>
#include <rclcpp/node.hpp>
Expand Down Expand Up @@ -118,7 +118,7 @@ int main(int argc, char** argv)
if (!conn->connect())
return 1;

rclcpp::executors::StaticSingleThreadedExecutor executor;
rclcpp::executors::SingleThreadedExecutor executor;
executor.add_node(node);

rclcpp::Rate rate(static_cast<int64_t>(delay) * 1000ms);
Expand Down

0 comments on commit 3c88f3d

Please sign in to comment.