#include <move_base_to_manip.h>
Public Member Functions | |
base_planner () | |
Private Member Functions | |
const double | cartesian_motion (const std::vector< geometry_msgs::Pose > &waypoints, moveit_msgs::RobotTrajectory &trajectory, moveit::planning_interface::MoveGroupInterface &moveGroup) |
void | do_motion_CB (const move_base_to_manip::desired_poseGoalConstPtr &goal) |
void | set_node_params () |
Private Attributes | |
actionlib::SimpleActionServer< move_base_to_manip::desired_poseAction > | as_ |
ros::ServiceClient | clear_costmaps_client_ = nh_.serviceClient<std_srvs::Empty>("/move_base/clear_costmaps") |
ros::ServiceClient | clear_octomap_client_ = nh_.serviceClient<std_srvs::Empty>("clear_octomap") |
std_srvs::Empty | empty_srv_ |
moveit::planning_interface::MoveGroupInterface::Plan | move_plan_ |
ros::NodeHandle | nh_ |
Definition at line 21 of file move_base_to_manip.h.
base_planner::base_planner | ( | ) |
Definition at line 39 of file move_base_to_manip.cpp.
|
private |
Definition at line 245 of file move_base_to_manip.cpp.
|
private |
Definition at line 54 of file move_base_to_manip.cpp.
|
private |
Definition at line 264 of file move_base_to_manip.cpp.
|
private |
Definition at line 35 of file move_base_to_manip.h.
|
private |
Definition at line 37 of file move_base_to_manip.h.
|
private |
Definition at line 38 of file move_base_to_manip.h.
|
private |
Definition at line 39 of file move_base_to_manip.h.
|
private |
Definition at line 36 of file move_base_to_manip.h.
|
private |
Definition at line 34 of file move_base_to_manip.h.