Skip to content

Commit 5dead36

Browse files
authored
Modernize code (#748)
- Switch to pluginlib.hpp - Use boost::placeholders
1 parent adbd6cc commit 5dead36

File tree

4 files changed

+5
-5
lines changed

4 files changed

+5
-5
lines changed

doc/creating_moveit_plugins/lerp_motion_planner/src/lerp_example.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -38,7 +38,7 @@
3838

3939
#include <ros/ros.h>
4040

41-
#include <pluginlib/class_loader.h>
41+
#include <pluginlib/class_loader.hpp>
4242

4343
// MoveIt!
4444
#include <moveit/robot_model_loader/robot_model_loader.h>

doc/interactivity/src/interactive_robot.cpp

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -89,12 +89,12 @@ InteractiveRobot::InteractiveRobot(const std::string& robot_description, const s
8989

9090
// Create a marker to control the "panda_arm" group
9191
imarker_robot_ = new IMarker(interactive_marker_server_, "robot", desired_group_end_link_pose_, "/panda_link0",
92-
boost::bind(movedRobotMarkerCallback, this, _1), IMarker::BOTH);
92+
boost::bind(movedRobotMarkerCallback, this, boost::placeholders::_1), IMarker::BOTH);
9393

9494
// create an interactive marker to control the world geometry (the yellow cube)
9595
desired_world_object_pose_ = DEFAULT_WORLD_OBJECT_POSE_;
9696
imarker_world_ = new IMarker(interactive_marker_server_, "world", desired_world_object_pose_, "/panda_link0",
97-
boost::bind(movedWorldMarkerCallback, this, _1), IMarker::POS);
97+
boost::bind(movedWorldMarkerCallback, this, boost::placeholders::_1), IMarker::POS);
9898

9999
// start publishing timer.
100100
init_time_ = ros::Time::now();

doc/motion_planning_api/src/motion_planning_api_tutorial.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -34,7 +34,7 @@
3434

3535
/* Author: Sachin Chitta, Michael Lautman */
3636

37-
#include <pluginlib/class_loader.h>
37+
#include <pluginlib/class_loader.hpp>
3838
#include <ros/ros.h>
3939

4040
// MoveIt

doc/motion_planning_pipeline/src/motion_planning_pipeline_tutorial.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -34,7 +34,7 @@
3434

3535
/* Author: Sachin Chitta, Mike Lautman*/
3636

37-
#include <pluginlib/class_loader.h>
37+
#include <pluginlib/class_loader.hpp>
3838
#include <ros/ros.h>
3939

4040
// MoveIt

0 commit comments

Comments
 (0)