Functions | |
const double | cartesian_motion (const std::vector< geometry_msgs::Pose > &waypoints, moveit_msgs::RobotTrajectory &trajectory, moveit::planning_interface::MoveGroup &moveGroup, ros::NodeHandle &nh) |
void | set_node_params (ros::NodeHandle &nh) |
void | setup_base_marker (visualization_msgs::Marker &baseMarker, move_base_msgs::MoveBaseGoal &goal) |
void | setup_move_group (ros::NodeHandle &nh, moveit::planning_interface::MoveGroup &moveGroup) |
Variables | |
ros::ServiceClient | clear_costmaps_client |
ros::ServiceClient | clear_octomap_client |
std_srvs::Empty | empty_srv |
const double move_base_to_manip::cartesian_motion | ( | const std::vector< geometry_msgs::Pose > & | waypoints, |
moveit_msgs::RobotTrajectory & | trajectory, | ||
moveit::planning_interface::MoveGroup & | moveGroup, | ||
ros::NodeHandle & | nh | ||
) |
Definition at line 295 of file move_base_to_manip.cpp.
void move_base_to_manip::set_node_params | ( | ros::NodeHandle & | nh | ) |
Definition at line 228 of file move_base_to_manip.cpp.
void move_base_to_manip::setup_base_marker | ( | visualization_msgs::Marker & | baseMarker, |
move_base_msgs::MoveBaseGoal & | goal | ||
) |
Definition at line 328 of file move_base_to_manip.cpp.
void move_base_to_manip::setup_move_group | ( | ros::NodeHandle & | nh, |
moveit::planning_interface::MoveGroup & | moveGroup | ||
) |
Definition at line 309 of file move_base_to_manip.cpp.
Definition at line 25 of file move_base_to_manip.h.
Definition at line 24 of file move_base_to_manip.h.
std_srvs::Empty move_base_to_manip::empty_srv |
Definition at line 28 of file move_base_to_manip.h.