diff --git a/nav2_costmap_2d/src/costmap_2d_publisher.cpp b/nav2_costmap_2d/src/costmap_2d_publisher.cpp index 965ec68894..96d98c3d37 100644 --- a/nav2_costmap_2d/src/costmap_2d_publisher.cpp +++ b/nav2_costmap_2d/src/costmap_2d_publisher.cpp @@ -66,7 +66,7 @@ Costmap2DPublisher::Costmap2DPublisher( logger_ = node->get_logger(); const auto custom_qos = rclcpp::QoS(rclcpp::KeepLast(1)).transient_local().reliable(); rclcpp::PublisherOptionsWithAllocator> pub_options; - pub_options.use_intra_process_comm = rclcpp::IntraProcessSetting::Disable; + // pub_options.use_intra_process_comm = rclcpp::IntraProcessSetting::Disable; costmap_pub_ =