Skip to content

Commit

Permalink
[DEX] Revert rolling deprecated constructor update
Browse files Browse the repository at this point in the history
  • Loading branch information
kaichie committed Jan 16, 2025
1 parent 0799bec commit 1209f5a
Showing 1 changed file with 2 additions and 1 deletion.
3 changes: 2 additions & 1 deletion nav2_costmap_2d/plugins/obstacle_layer.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -226,7 +226,8 @@ void ObstacleLayer::onInitialize()
source.c_str(), topic.c_str(),
global_frame_.c_str(), expected_update_rate, observation_keep_time);

const auto custom_qos_profile = rclcpp::SensorDataQoS().keep_last(50);
rmw_qos_profile_t custom_qos_profile = rmw_qos_profile_sensor_data;
custom_qos_profile.depth = 50;

// create a callback for the topic
if (data_type == "LaserScan") {
Expand Down

0 comments on commit 1209f5a

Please sign in to comment.