We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent 0211977 commit c41f69bCopy full SHA for c41f69b
nav2_amcl/src/amcl_node.cpp
@@ -699,7 +699,12 @@ AmclNode::laserReceived(sensor_msgs::msg::LaserScan::ConstSharedPtr laser_scan)
699
// If the robot has moved, update the filter
700
if (lasers_update_[laser_index]) {
701
updateFilter(laser_index, laser_scan, pose);
702
-
+ if(resample_interval_ == 0){
703
+ RCLCPP_WARN(
704
+ get_logger(), "You've set resample_interval to be zero,"
705
+ " this isn't allowed so it will be set to default value to 1.");
706
+ resample_interval_ = 1;
707
+ }
708
// Resample the particles
709
if (!(++resample_count_ % resample_interval_)) {
710
pf_update_resample(pf_);
0 commit comments