Skip to content
This repository was archived by the owner on Jun 5, 2025. It is now read-only.

Commit f44bb1f

Browse files
authored
Eol work (#1269)
* Upgrade Minimum CMake Version * Remove calls to boost::bind
1 parent 9ad6441 commit f44bb1f

File tree

21 files changed

+26
-26
lines changed

21 files changed

+26
-26
lines changed

amcl/CMakeLists.txt

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
cmake_minimum_required(VERSION 3.1)
1+
cmake_minimum_required(VERSION 3.10.2)
22
project(amcl)
33

44
include(CheckIncludeFile)

amcl/src/amcl_node.cpp

Lines changed: 6 additions & 6 deletions
Original file line numberDiff line numberDiff line change
@@ -489,8 +489,8 @@ AmclNode::AmclNode() :
489489
odom_frame_id_,
490490
100,
491491
nh_);
492-
laser_scan_filter_->registerCallback(boost::bind(&AmclNode::laserReceived,
493-
this, _1));
492+
laser_scan_filter_->registerCallback(std::bind(&AmclNode::laserReceived,
493+
this, std::placeholders::_1));
494494
initial_pose_sub_ = nh_.subscribe("initialpose", 2, &AmclNode::initialPoseReceived, this);
495495

496496
if(use_map_topic_) {
@@ -502,13 +502,13 @@ AmclNode::AmclNode() :
502502
m_force_update = false;
503503

504504
dsrv_ = new dynamic_reconfigure::Server<amcl::AMCLConfig>(ros::NodeHandle("~"));
505-
dynamic_reconfigure::Server<amcl::AMCLConfig>::CallbackType cb = boost::bind(&AmclNode::reconfigureCB, this, _1, _2);
505+
dynamic_reconfigure::Server<amcl::AMCLConfig>::CallbackType cb = std::bind(&AmclNode::reconfigureCB, this, std::placeholders::_1, std::placeholders::_2);
506506
dsrv_->setCallback(cb);
507507

508508
// 15s timer to warn on lack of receipt of laser scans, #5209
509509
laser_check_interval_ = ros::Duration(15.0);
510510
check_laser_timer_ = nh_.createTimer(laser_check_interval_,
511-
boost::bind(&AmclNode::checkLaserReceived, this, _1));
511+
std::bind(&AmclNode::checkLaserReceived, this, std::placeholders::_1));
512512

513513
diagnosic_updater_.setHardwareID("None");
514514
diagnosic_updater_.add("Standard deviation", this, &AmclNode::standardDeviationDiagnostics);
@@ -666,8 +666,8 @@ void AmclNode::reconfigureCB(AMCLConfig &config, uint32_t level)
666666
odom_frame_id_,
667667
100,
668668
nh_);
669-
laser_scan_filter_->registerCallback(boost::bind(&AmclNode::laserReceived,
670-
this, _1));
669+
laser_scan_filter_->registerCallback(std::bind(&AmclNode::laserReceived,
670+
this, std::placeholders::_1));
671671

672672
initial_pose_sub_ = nh_.subscribe("initialpose", 2, &AmclNode::initialPoseReceived, this);
673673
}

base_local_planner/CMakeLists.txt

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
cmake_minimum_required(VERSION 3.0.2)
1+
cmake_minimum_required(VERSION 3.10.2)
22
project(base_local_planner)
33

44
include(CheckIncludeFile)

carrot_planner/CMakeLists.txt

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
cmake_minimum_required(VERSION 3.0.2)
1+
cmake_minimum_required(VERSION 3.10.2)
22
project(carrot_planner)
33

44
find_package(catkin REQUIRED

clear_costmap_recovery/CMakeLists.txt

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
cmake_minimum_required(VERSION 3.0.2)
1+
cmake_minimum_required(VERSION 3.10.2)
22
project(clear_costmap_recovery)
33

44
find_package(catkin REQUIRED

costmap_2d/CMakeLists.txt

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
cmake_minimum_required(VERSION 3.0.2)
1+
cmake_minimum_required(VERSION 3.10.2)
22
project(costmap_2d)
33

44
find_package(catkin REQUIRED

costmap_2d/src/costmap_2d_publisher.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -50,7 +50,7 @@ Costmap2DPublisher::Costmap2DPublisher(ros::NodeHandle * ros_node, Costmap2D* co
5050
always_send_full_costmap_(always_send_full_costmap)
5151
{
5252
costmap_pub_ = ros_node->advertise<nav_msgs::OccupancyGrid>(topic_name, 1,
53-
boost::bind(&Costmap2DPublisher::onNewSubscription, this, _1));
53+
std::bind(&Costmap2DPublisher::onNewSubscription, this, std::placeholders::_1));
5454
costmap_update_pub_ = ros_node->advertise<map_msgs::OccupancyGridUpdate>(topic_name + "_updates", 1);
5555

5656
if (cost_translation_table_ == NULL)

costmap_2d/src/costmap_2d_ros.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -352,7 +352,7 @@ void Costmap2DROS::reconfigureCB(costmap_2d::Costmap2DConfig &config, uint32_t l
352352

353353
// only construct the thread if the frequency is positive
354354
if(map_update_frequency > 0.0)
355-
map_update_thread_ = new boost::thread(boost::bind(&Costmap2DROS::mapUpdateLoop, this, map_update_frequency));
355+
map_update_thread_ = new boost::thread(std::bind(&Costmap2DROS::mapUpdateLoop, this, map_update_frequency));
356356
}
357357

358358
void Costmap2DROS::readFootprintFromConfig(const costmap_2d::Costmap2DConfig &new_config,

dwa_local_planner/CMakeLists.txt

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
cmake_minimum_required(VERSION 3.0.2)
1+
cmake_minimum_required(VERSION 3.10.2)
22
project(dwa_local_planner)
33

44
find_package(catkin REQUIRED

fake_localization/CMakeLists.txt

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,4 +1,4 @@
1-
cmake_minimum_required(VERSION 3.0.2)
1+
cmake_minimum_required(VERSION 3.10.2)
22
project(fake_localization)
33

44
find_package(catkin REQUIRED

0 commit comments

Comments
 (0)