Skip to content

Commit

Permalink
undo header change
Browse files Browse the repository at this point in the history
  • Loading branch information
pac48 committed Nov 5, 2024
1 parent 9afaaf5 commit 9b47cde
Showing 1 changed file with 7 additions and 8 deletions.
15 changes: 7 additions & 8 deletions moveit_ros/move_group/src/move_group.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -34,18 +34,17 @@

/* Author: Ioan Sucan */

#include <memory>
#include <set>

#include <boost/tokenizer.hpp>
#include <moveit/macros/console_colors.h>
#include <moveit/move_group/move_group_capability.h>
#include <moveit/move_group/move_group_context.h>
#include <moveit/moveit_cpp/moveit_cpp.h>
#include <moveit/planning_scene_monitor/planning_scene_monitor.h>
#include <tf2_ros/transform_listener.h>
#include <moveit/move_group/move_group_capability.h>
#include <moveit/trajectory_execution_manager/trajectory_execution_manager.h>
#include <boost/tokenizer.hpp>
#include <moveit/macros/console_colors.h>
#include <moveit/move_group/move_group_context.h>
#include <memory>
#include <set>
#include <moveit/utils/logger.hpp>
#include <tf2_ros/transform_listener.h>

static const std::string ROBOT_DESCRIPTION =
"robot_description"; // name of the robot description (a param name, so it can be changed externally)
Expand Down

0 comments on commit 9b47cde

Please sign in to comment.