Skip to content
Prev Previous commit
Next Next commit
Update amcl_node.cpp
Signed-off-by: Steve Macenski <stevenmacenski@gmail.com>
  • Loading branch information
SteveMacenski authored Jun 11, 2025
commit 9345ed3467ac22bd7a58c9c36a255586f7dd8ff1
2 changes: 1 addition & 1 deletion nav2_amcl/src/amcl_node.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -1529,7 +1529,7 @@ AmclNode::initMessageFilters()
shared_from_this(), scan_topic_, rclcpp::SensorDataQoS(), sub_opt);
#else
laser_scan_sub_ = std::make_unique<message_filters::Subscriber<sensor_msgs::msg::LaserScan,
nav2::LifecycleNode>>(
rclcpp_lifecycle::LifecycleNode>>(
shared_from_this(), scan_topic_, rmw_qos_profile_sensor_data, sub_opt);
#endif

Expand Down
Loading