moveit::planning_interface::MoveGroupInterface Member List

This is the complete list of members for moveit::planning_interface::MoveGroupInterface, including all inherited members.

allowLooking(bool flag)moveit::planning_interface::MoveGroupInterface
allowReplanning(bool flag)moveit::planning_interface::MoveGroupInterface
asyncExecute(const Plan &plan)moveit::planning_interface::MoveGroupInterface
asyncExecute(const moveit_msgs::RobotTrajectory &trajectory)moveit::planning_interface::MoveGroupInterface
asyncMove()moveit::planning_interface::MoveGroupInterface
attachObject(const std::string &object, const std::string &link="")moveit::planning_interface::MoveGroupInterface
attachObject(const std::string &object, const std::string &link, const std::vector< std::string > &touch_links)moveit::planning_interface::MoveGroupInterface
clearMaxCartesianLinkSpeed()moveit::planning_interface::MoveGroupInterface
clearPathConstraints()moveit::planning_interface::MoveGroupInterface
clearPoseTarget(const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
clearPoseTargets()moveit::planning_interface::MoveGroupInterface
clearTrajectoryConstraints()moveit::planning_interface::MoveGroupInterface
computeCartesianPath(const std::vector< geometry_msgs::Pose > &waypoints, double eef_step, double jump_threshold, moveit_msgs::RobotTrajectory &trajectory, bool avoid_collisions=true, moveit_msgs::MoveItErrorCodes *error_code=nullptr)moveit::planning_interface::MoveGroupInterface
computeCartesianPath(const std::vector< geometry_msgs::Pose > &waypoints, double eef_step, double jump_threshold, moveit_msgs::RobotTrajectory &trajectory, const moveit_msgs::Constraints &path_constraints, bool avoid_collisions=true, moveit_msgs::MoveItErrorCodes *error_code=nullptr)moveit::planning_interface::MoveGroupInterface
constructMotionPlanRequest(moveit_msgs::MotionPlanRequest &request)moveit::planning_interface::MoveGroupInterface
constructPickupGoal(const std::string &object, std::vector< moveit_msgs::Grasp > grasps, bool plan_only) constmoveit::planning_interface::MoveGroupInterface
constructPlaceGoal(const std::string &object, std::vector< moveit_msgs::PlaceLocation > locations, bool plan_only) constmoveit::planning_interface::MoveGroupInterface
DEFAULT_ALLOWED_PLANNING_TIMEmoveit::planning_interface::MoveGroupInterfacestatic
DEFAULT_GOAL_JOINT_TOLERANCEmoveit::planning_interface::MoveGroupInterfacestatic
DEFAULT_GOAL_ORIENTATION_TOLERANCEmoveit::planning_interface::MoveGroupInterfacestatic
DEFAULT_GOAL_POSITION_TOLERANCEmoveit::planning_interface::MoveGroupInterfacestatic
DEFAULT_NUM_PLANNING_ATTEMPTSmoveit::planning_interface::MoveGroupInterfacestatic
detachObject(const std::string &name="")moveit::planning_interface::MoveGroupInterface
execute(const Plan &plan)moveit::planning_interface::MoveGroupInterface
execute(const moveit_msgs::RobotTrajectory &trajectory)moveit::planning_interface::MoveGroupInterface
forgetJointValues(const std::string &name)moveit::planning_interface::MoveGroupInterface
getActiveJoints() constmoveit::planning_interface::MoveGroupInterface
getCurrentJointValues() constmoveit::planning_interface::MoveGroupInterface
getCurrentPose(const std::string &end_effector_link="") constmoveit::planning_interface::MoveGroupInterface
getCurrentRPY(const std::string &end_effector_link="") constmoveit::planning_interface::MoveGroupInterface
getCurrentState(double wait=1) constmoveit::planning_interface::MoveGroupInterface
getDefaultPlannerId(const std::string &group="") constmoveit::planning_interface::MoveGroupInterface
getDefaultPlanningPipelineId() constmoveit::planning_interface::MoveGroupInterface
getEndEffector() constmoveit::planning_interface::MoveGroupInterface
getEndEffectorLink() constmoveit::planning_interface::MoveGroupInterface
getGoalJointTolerance() constmoveit::planning_interface::MoveGroupInterface
getGoalOrientationTolerance() constmoveit::planning_interface::MoveGroupInterface
getGoalPositionTolerance() constmoveit::planning_interface::MoveGroupInterface
getInterfaceDescription(moveit_msgs::PlannerInterfaceDescription &desc) constmoveit::planning_interface::MoveGroupInterface
getInterfaceDescriptions(std::vector< moveit_msgs::PlannerInterfaceDescription > &desc) constmoveit::planning_interface::MoveGroupInterface
getJointModelGroupNames() constmoveit::planning_interface::MoveGroupInterface
getJointNames() constmoveit::planning_interface::MoveGroupInterfaceinline
getJoints() constmoveit::planning_interface::MoveGroupInterface
getJointValueTarget(std::vector< double > &group_variable_values) constmoveit::planning_interface::MoveGroupInterface
getJointValueTarget() constmoveit::planning_interface::MoveGroupInterface
getKnownConstraints() constmoveit::planning_interface::MoveGroupInterface
getLinkNames() constmoveit::planning_interface::MoveGroupInterface
getMoveGroupClient() constmoveit::planning_interface::MoveGroupInterface
getName() constmoveit::planning_interface::MoveGroupInterface
getNamedTargets() constmoveit::planning_interface::MoveGroupInterface
getNamedTargetValues(const std::string &name) constmoveit::planning_interface::MoveGroupInterface
getNodeHandle() constmoveit::planning_interface::MoveGroupInterface
getPathConstraints() constmoveit::planning_interface::MoveGroupInterface
getPlannerId() constmoveit::planning_interface::MoveGroupInterface
getPlannerParams(const std::string &planner_id, const std::string &group="") constmoveit::planning_interface::MoveGroupInterface
getPlanningFrame() constmoveit::planning_interface::MoveGroupInterface
getPlanningPipelineId() constmoveit::planning_interface::MoveGroupInterface
getPlanningTime() constmoveit::planning_interface::MoveGroupInterface
getPoseReferenceFrame() constmoveit::planning_interface::MoveGroupInterface
getPoseTarget(const std::string &end_effector_link="") constmoveit::planning_interface::MoveGroupInterface
getPoseTargets(const std::string &end_effector_link="") constmoveit::planning_interface::MoveGroupInterface
getRandomJointValues() constmoveit::planning_interface::MoveGroupInterface
getRandomPose(const std::string &end_effector_link="") constmoveit::planning_interface::MoveGroupInterface
getRememberedJointValues() constmoveit::planning_interface::MoveGroupInterfaceinline
getRobotModel() constmoveit::planning_interface::MoveGroupInterface
getTargetRobotState() constmoveit::planning_interface::MoveGroupInterfaceprotected
getTrajectoryConstraints() constmoveit::planning_interface::MoveGroupInterface
getVariableCount() constmoveit::planning_interface::MoveGroupInterface
getVariableNames() constmoveit::planning_interface::MoveGroupInterface
impl_moveit::planning_interface::MoveGroupInterfaceprivate
limitMaxCartesianLinkSpeed(const double max_speed, const std::string &link_name="")moveit::planning_interface::MoveGroupInterface
move()moveit::planning_interface::MoveGroupInterface
MoveGroupInterface(const Options &opt, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer=std::shared_ptr< tf2_ros::Buffer >(), const ros::WallDuration &wait_for_servers=ros::WallDuration())moveit::planning_interface::MoveGroupInterface
MoveGroupInterface(const Options &opt, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer, const ros::Duration &wait_for_servers)moveit::planning_interface::MoveGroupInterface
MoveGroupInterface(const std::string &group, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer=std::shared_ptr< tf2_ros::Buffer >(), const ros::WallDuration &wait_for_servers=ros::WallDuration())moveit::planning_interface::MoveGroupInterface
MoveGroupInterface(const std::string &group, const std::shared_ptr< tf2_ros::Buffer > &tf_buffer, const ros::Duration &wait_for_servers)moveit::planning_interface::MoveGroupInterface
MoveGroupInterface(const MoveGroupInterface &)=deletemoveit::planning_interface::MoveGroupInterface
MoveGroupInterface(MoveGroupInterface &&other) noexceptmoveit::planning_interface::MoveGroupInterface
MOVEIT_STRUCT_FORWARD(Plan)moveit::planning_interface::MoveGroupInterface
operator=(const MoveGroupInterface &)=deletemoveit::planning_interface::MoveGroupInterface
operator=(MoveGroupInterface &&other) noexceptmoveit::planning_interface::MoveGroupInterface
pick(const std::string &object, bool plan_only=false)moveit::planning_interface::MoveGroupInterfaceinline
pick(const std::string &object, const moveit_msgs::Grasp &grasp, bool plan_only=false)moveit::planning_interface::MoveGroupInterfaceinline
pick(const std::string &object, std::vector< moveit_msgs::Grasp > grasps, bool plan_only=false)moveit::planning_interface::MoveGroupInterfaceinline
pick(const moveit_msgs::PickupGoal &goal)moveit::planning_interface::MoveGroupInterface
place(const std::string &object, bool plan_only=false)moveit::planning_interface::MoveGroupInterfaceinline
place(const std::string &object, std::vector< moveit_msgs::PlaceLocation > locations, bool plan_only=false)moveit::planning_interface::MoveGroupInterfaceinline
place(const std::string &object, const std::vector< geometry_msgs::PoseStamped > &poses, bool plan_only=false)moveit::planning_interface::MoveGroupInterfaceinline
place(const std::string &object, const geometry_msgs::PoseStamped &pose, bool plan_only=false)moveit::planning_interface::MoveGroupInterfaceinline
place(const moveit_msgs::PlaceGoal &goal)moveit::planning_interface::MoveGroupInterface
plan(Plan &plan)moveit::planning_interface::MoveGroupInterface
planGraspsAndPick(const std::string &object="", bool plan_only=false)moveit::planning_interface::MoveGroupInterface
planGraspsAndPick(const moveit_msgs::CollisionObject &object, bool plan_only=false)moveit::planning_interface::MoveGroupInterface
posesToPlaceLocations(const std::vector< geometry_msgs::PoseStamped > &poses) constmoveit::planning_interface::MoveGroupInterface
remembered_joint_values_moveit::planning_interface::MoveGroupInterfaceprivate
rememberJointValues(const std::string &name)moveit::planning_interface::MoveGroupInterface
rememberJointValues(const std::string &name, const std::vector< double > &values)moveit::planning_interface::MoveGroupInterface
ROBOT_DESCRIPTIONmoveit::planning_interface::MoveGroupInterfacestatic
setApproximateJointValueTarget(const geometry_msgs::Pose &eef_pose, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setApproximateJointValueTarget(const geometry_msgs::PoseStamped &eef_pose, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setApproximateJointValueTarget(const Eigen::Isometry3d &eef_pose, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setConstraintsDatabase(const std::string &host, unsigned int port)moveit::planning_interface::MoveGroupInterface
setEndEffector(const std::string &eef_name)moveit::planning_interface::MoveGroupInterface
setEndEffectorLink(const std::string &end_effector_link)moveit::planning_interface::MoveGroupInterface
setGoalJointTolerance(double tolerance)moveit::planning_interface::MoveGroupInterface
setGoalOrientationTolerance(double tolerance)moveit::planning_interface::MoveGroupInterface
setGoalPositionTolerance(double tolerance)moveit::planning_interface::MoveGroupInterface
setGoalTolerance(double tolerance)moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const std::vector< double > &group_variable_values)moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const std::map< std::string, double > &variable_values)moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const std::vector< std::string > &variable_names, const std::vector< double > &variable_values)moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const moveit::core::RobotState &robot_state)moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const std::string &joint_name, const std::vector< double > &values)moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const std::string &joint_name, double value)moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const sensor_msgs::JointState &state)moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const geometry_msgs::Pose &eef_pose, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const geometry_msgs::PoseStamped &eef_pose, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setJointValueTarget(const Eigen::Isometry3d &eef_pose, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setLookAroundAttempts(int32_t attempts)moveit::planning_interface::MoveGroupInterface
setMaxAccelerationScalingFactor(double max_acceleration_scaling_factor)moveit::planning_interface::MoveGroupInterface
setMaxVelocityScalingFactor(double max_velocity_scaling_factor)moveit::planning_interface::MoveGroupInterface
setNamedTarget(const std::string &name)moveit::planning_interface::MoveGroupInterface
setNumPlanningAttempts(unsigned int num_planning_attempts)moveit::planning_interface::MoveGroupInterface
setOrientationTarget(double x, double y, double z, double w, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setPathConstraints(const std::string &constraint)moveit::planning_interface::MoveGroupInterface
setPathConstraints(const moveit_msgs::Constraints &constraint)moveit::planning_interface::MoveGroupInterface
setPlannerId(const std::string &planner_id)moveit::planning_interface::MoveGroupInterface
setPlannerParams(const std::string &planner_id, const std::string &group, const std::map< std::string, std::string > &params, bool bReplace=false)moveit::planning_interface::MoveGroupInterface
setPlanningPipelineId(const std::string &pipeline_id)moveit::planning_interface::MoveGroupInterface
setPlanningTime(double seconds)moveit::planning_interface::MoveGroupInterface
setPoseReferenceFrame(const std::string &pose_reference_frame)moveit::planning_interface::MoveGroupInterface
setPoseTarget(const Eigen::Isometry3d &end_effector_pose, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setPoseTarget(const geometry_msgs::Pose &target, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setPoseTarget(const geometry_msgs::PoseStamped &target, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setPoseTargets(const EigenSTL::vector_Isometry3d &end_effector_pose, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setPoseTargets(const std::vector< geometry_msgs::Pose > &target, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setPoseTargets(const std::vector< geometry_msgs::PoseStamped > &target, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setPositionTarget(double x, double y, double z, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setRandomTarget()moveit::planning_interface::MoveGroupInterface
setReplanAttempts(int32_t attempts)moveit::planning_interface::MoveGroupInterface
setReplanDelay(double delay)moveit::planning_interface::MoveGroupInterface
setRPYTarget(double roll, double pitch, double yaw, const std::string &end_effector_link="")moveit::planning_interface::MoveGroupInterface
setStartState(const moveit_msgs::RobotState &start_state)moveit::planning_interface::MoveGroupInterface
setStartState(const moveit::core::RobotState &start_state)moveit::planning_interface::MoveGroupInterface
setStartStateToCurrentState()moveit::planning_interface::MoveGroupInterface
setSupportSurfaceName(const std::string &name)moveit::planning_interface::MoveGroupInterface
setTrajectoryConstraints(const moveit_msgs::TrajectoryConstraints &constraint)moveit::planning_interface::MoveGroupInterface
setWorkspace(double minx, double miny, double minz, double maxx, double maxy, double maxz)moveit::planning_interface::MoveGroupInterface
startStateMonitor(double wait=1.0)moveit::planning_interface::MoveGroupInterface
stop()moveit::planning_interface::MoveGroupInterface
~MoveGroupInterface()moveit::planning_interface::MoveGroupInterface


planning_interface
Author(s): Ioan Sucan
autogenerated on Thu Apr 18 2024 02:25:17