Go to the documentation of this file.
42 #include <moveit_msgs/MoveItErrorCodes.h>
80 std::vector<planning_interface::MotionPlanResponse>
const&
getSolutions()
const
86 std::vector<planning_interface::MotionPlanResponse>
solutions_;
91 struct PlanRequestParameters
102 std::string ns =
"plan_request_params/";
103 if (!param_namespace.empty())
105 ns = param_namespace +
"/plan_request_params/";
121 const std::vector<std::string>& planning_pipeline_names)
125 for (
auto const& planning_pipeline_name : planning_pipeline_names)
128 parameters.
load(nh, planning_pipeline_name);
138 std::vector<planning_interface::MotionPlanResponse>
const& solutions)>
176 void setWorkspace(
double minx,
double miny,
double minz,
double maxx,
double maxy,
double maxz);
193 bool setGoal(
const std::vector<moveit_msgs::Constraints>& goal_constraints);
197 bool setGoal(
const geometry_msgs::PoseStamped& goal_pose,
const std::string& link_name);
199 bool setGoal(
const std::string& named_target);
223 bool execute(
bool blocking =
true);
std::mutex solutions_mutex_
moveit::core::MoveItErrorCode MoveItErrorCode
std::vector< planning_interface::MotionPlanResponse > solutions_
bool setStartState(const moveit::core::RobotState &start_state)
Set the robot state that should be considered as start state for planning.
MultiPipelinePlanRequestParameters(const ros::NodeHandle &nh, const std::vector< std::string > &planning_pipeline_names)
planning_interface::MotionPlanResponse const & getLastMotionPlanResponse()
Return the last plan solution.
std::vector< PlanRequestParameters > multi_plan_request_parameters
const std::string group_name_
planning_interface::MotionPlanResponse plan()
Run a plan from start or current state to fulfill the last goal constraints provided by setGoal() usi...
void pushBack(const planning_interface::MotionPlanResponse &plan_solution)
Thread safe method to add PlanSolutions to this data structure TODO(sjahr): Refactor this method to a...
void setWorkspace(double minx, double miny, double minz, double maxx, double maxy, double maxz)
Specify the workspace bounding box. The box is specified in the planning frame (i....
bool execute(bool blocking=true)
Execute the latest computed solution trajectory computed by plan(). By default this function terminat...
bool setTrajectoryConstraints(const moveit_msgs::TrajectoryConstraints &trajectory_constraints)
Set the trajectory constraints generated from a moveit msg Constraints.
double max_acceleration_scaling_factor
void load(const ros::NodeHandle &nh, const std::string ¶m_namespace="")
std::function< planning_interface::MotionPlanResponse(std::vector< planning_interface::MotionPlanResponse > const &solutions)> SolutionCallbackFunction
A solution callback function type for the parallel planning API of planning component.
void unsetWorkspace()
Remove the workspace bounding box from planning.
std::map< std::string, double > getNamedTargetStateValues(const std::string &name)
Get the joint values for targets specified by name.
void clearContents()
Reset all member variables.
std::vector< planning_interface::MotionPlanResponse > const & getSolutions() const
Get solutions.
std::string planning_pipeline
moveit_msgs::Constraints current_path_constraints_
MOVEIT_DECLARE_PTR(MoveItCpp, moveit_cpp::MoveItCpp)
Planner parameters provided with the MotionPlanRequest.
void setStartStateToCurrentState()
Set the start state for planning to be the current state of the robot.
moveit::core::RobotStatePtr getStartState()
Get the considered start state if defined, otherwise get the current state.
std::vector< moveit_msgs::Constraints > current_goal_constraints_
Planner parameters provided with the MotionPlanRequest.
~PlanningComponent()
Destructor.
double max_velocity_scaling_factor
planning_interface::MotionPlanResponse getShortestSolution(std::vector< planning_interface::MotionPlanResponse > const &solutions)
A function to choose the solution with the shortest path from a vector of solutions.
const moveit::core::JointModelGroup * joint_model_group_
moveit_msgs::WorkspaceParameters workspace_parameters_
const std::string & getPlanningGroupName() const
Get the name of the planning group.
std::function< bool(PlanSolutions const &solutions, MultiPipelinePlanRequestParameters const &plan_request_parameters)> StoppingCriterionFunction
A stopping criterion callback function for the parallel planning API of planning component.
moveit::core::RobotStatePtr considered_start_state_
bool setGoal(const std::vector< moveit_msgs::Constraints > &goal_constraints)
Set the goal constraints used for planning.
PlanSolutions(const size_t expected_size=0)
Constructor.
T param(const std::string ¶m_name, const T &default_val) const
const std::vector< std::string > getNamedTargetStates()
Get the names of the named robot states available as targets.
bool setPathConstraints(const moveit_msgs::Constraints &path_constraints)
Set the path constraints used for planning.
moveit_msgs::TrajectoryConstraints current_trajectory_constraints_
bool workspace_parameters_set_
PlanningComponent(const std::string &group_name, const ros::NodeHandle &nh)
Constructor.
planning_interface::MotionPlanResponse last_plan_solution_
moveit_cpp::PlanningComponent PlanningComponent
MOVEIT_CLASS_FORWARD(MoveItCpp)
PlanRequestParameters plan_request_parameters_
PlanningComponent & operator=(const PlanningComponent &)=delete
planning
Author(s): Ioan Sucan
, Sachin Chitta
autogenerated on Thu Nov 21 2024 03:24:18