Skip to content

Commit

Permalink
update comment
Browse files Browse the repository at this point in the history
Signed-off-by: zhenpeng ge <zhenpeng.ge@qq.com>
  • Loading branch information
gezp committed May 28, 2022
1 parent b590666 commit fe68af7
Show file tree
Hide file tree
Showing 5 changed files with 1 addition and 5 deletions.
2 changes: 1 addition & 1 deletion nav2_costmap_2d/include/nav2_costmap_2d/costmap_2d_ros.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -311,7 +311,7 @@ class Costmap2DROS : public nav2_util::LifecycleNode
rclcpp::Subscription<geometry_msgs::msg::Polygon>::SharedPtr footprint_sub_;
rclcpp::Subscription<rcl_interfaces::msg::ParameterEvent>::SharedPtr parameter_sub_;

// Dedicated callback group and executor for plugins and filters
// Dedicated callback group and executor for tf timer_interface, costmap plugins and filters
rclcpp::CallbackGroup::SharedPtr callback_group_;
rclcpp::executors::SingleThreadedExecutor::SharedPtr executor_;
std::unique_ptr<nav2_util::NodeThread> executor_thread_;
Expand Down
1 change: 0 additions & 1 deletion nav2_costmap_2d/plugins/costmap_filters/keepout_filter.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -65,7 +65,6 @@ void KeepoutFilter::initializeFilter(

filter_info_topic_ = filter_info_topic;

// use dedicated callback group for filter info and mask subscriber
auto sub_opt = rclcpp::SubscriptionOptions();
sub_opt.callback_group = callback_group_;

Expand Down
1 change: 0 additions & 1 deletion nav2_costmap_2d/plugins/costmap_filters/speed_filter.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -73,7 +73,6 @@ void SpeedFilter::initializeFilter(

filter_info_topic_ = filter_info_topic;

// use dedicated callback group for filter info and mask subscriber
auto sub_opt = rclcpp::SubscriptionOptions();
sub_opt.callback_group = callback_group_;

Expand Down
1 change: 0 additions & 1 deletion nav2_costmap_2d/plugins/obstacle_layer.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -119,7 +119,6 @@ void ObstacleLayer::onInitialize()

global_frame_ = layered_costmap_->getGlobalFrameID();

// use a dedicated callback group for observation message subscriber
auto sub_opt = rclcpp::SubscriptionOptions();
sub_opt.callback_group = callback_group_;

Expand Down
1 change: 0 additions & 1 deletion nav2_costmap_2d/plugins/range_sensor_layer.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -128,7 +128,6 @@ void RangeSensorLayer::onInitialize()
return;
}

// create a separate callback group for range subscriber
auto sub_opt = rclcpp::SubscriptionOptions();
sub_opt.callback_group = callback_group_;

Expand Down

0 comments on commit fe68af7

Please sign in to comment.