Skip to content
This repository has been archived by the owner on Aug 13, 2024. It is now read-only.

Commit

Permalink
drop use of obsolete _1 symbols
Browse files Browse the repository at this point in the history
The symbols have always been used through implicit includes from
ros_comm, but ROS-O considers changing these includes right now because
of excessive deprecation warnings building all of ROS.

ros-o/ros_comm#3
  • Loading branch information
v4hn committed Aug 11, 2024
1 parent 3802560 commit b936dfb
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion src/LaserProcROS.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -39,7 +39,7 @@ LaserProcROS::LaserProcROS(ros::NodeHandle& n, ros::NodeHandle& pnh):nh_(n){
boost::mutex::scoped_lock lock(connect_mutex_);

// Lazy subscription to multi echo topic
pub_ = laser_proc::LaserTransport::advertiseLaser(n, 10, boost::bind(&LaserProcROS::connectCb, this, _1), boost::bind(&LaserProcROS::disconnectCb, this, _1), ros::VoidPtr(), false, false);
pub_ = laser_proc::LaserTransport::advertiseLaser(n, 10, [this](auto& pub){ connectCb(pub); }, [this](auto& pub){ disconnectCb(pub); }, ros::VoidPtr(), false, false);
}

LaserProcROS::~LaserProcROS(){
Expand Down

0 comments on commit b936dfb

Please sign in to comment.