Public Member Functions | Private Member Functions | Private Attributes | List of all members
base_planner Class Reference

#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_
 

Detailed Description

Definition at line 21 of file move_base_to_manip.h.

Constructor & Destructor Documentation

base_planner::base_planner ( )

Definition at line 39 of file move_base_to_manip.cpp.

Member Function Documentation

const double base_planner::cartesian_motion ( const std::vector< geometry_msgs::Pose > &  waypoints,
moveit_msgs::RobotTrajectory &  trajectory,
moveit::planning_interface::MoveGroupInterface moveGroup 
)
private

Definition at line 245 of file move_base_to_manip.cpp.

void base_planner::do_motion_CB ( const move_base_to_manip::desired_poseGoalConstPtr &  goal)
private

Definition at line 54 of file move_base_to_manip.cpp.

void base_planner::set_node_params ( )
private

Definition at line 264 of file move_base_to_manip.cpp.

Member Data Documentation

actionlib::SimpleActionServer<move_base_to_manip::desired_poseAction> base_planner::as_
private

Definition at line 35 of file move_base_to_manip.h.

ros::ServiceClient base_planner::clear_costmaps_client_ = nh_.serviceClient<std_srvs::Empty>("/move_base/clear_costmaps")
private

Definition at line 37 of file move_base_to_manip.h.

ros::ServiceClient base_planner::clear_octomap_client_ = nh_.serviceClient<std_srvs::Empty>("clear_octomap")
private

Definition at line 38 of file move_base_to_manip.h.

std_srvs::Empty base_planner::empty_srv_
private

Definition at line 39 of file move_base_to_manip.h.

moveit::planning_interface::MoveGroupInterface::Plan base_planner::move_plan_
private

Definition at line 36 of file move_base_to_manip.h.

ros::NodeHandle base_planner::nh_
private

Definition at line 34 of file move_base_to_manip.h.


The documentation for this class was generated from the following files:


move_base_to_manip
Author(s): Andy Zelenak, Andy Zelenak
autogenerated on Sat Jul 18 2020 03:48:17