Skip to content

Commit

Permalink
Undone the deleted comment with a little modification
Browse files Browse the repository at this point in the history
  • Loading branch information
CihatAltiparmak committed Jun 22, 2024
1 parent 2a5c382 commit db86507
Showing 1 changed file with 2 additions and 0 deletions.
Original file line number Diff line number Diff line change
Expand Up @@ -112,6 +112,8 @@ class MoveGroupInterface::MoveGroupInterfaceImpl
const std::shared_ptr<tf2_ros::Buffer>& tf_buffer, const rclcpp::Duration& wait_for_servers)
: opt_(opt), node_(node), logger_(moveit::getLogger("moveit.ros.move_group_interface")), tf_buffer_(tf_buffer)
{
// We have no control on how the passed node is getting executed. To make sure MGI is functional, we're creating
// our own callback group which is managed in a separate executor
callback_group_ = node_->create_callback_group(rclcpp::CallbackGroupType::MutuallyExclusive,
false /* don't spin with node executor */);
callback_executor_.add_callback_group(callback_group_, node_->get_node_base_interface());
Expand Down

0 comments on commit db86507

Please sign in to comment.