Evaluates the cost of the goal pose by determining how far the Cartesian tool pose is from the desired under-constrained task manifold.
More...
#include <tool_goal_pose.h>
|
virtual bool | computeCosts (const Eigen::MatrixXd ¶meters, std::size_t start_timestep, std::size_t num_timesteps, int iteration_number, int rollout_number, Eigen::VectorXd &costs, bool &validity) override |
| computes the goal state costs as a function of the distance from the desired task manifold. More...
|
|
virtual bool | configure (const XmlRpc::XmlRpcValue &config) override |
| Sets internal members of the plugin from the configuration data. More...
|
|
virtual void | done (bool success, int total_iterations, double final_cost, const Eigen::MatrixXd ¶meters) override |
| Called by the Stomp Task at the end of the optimization process. More...
|
|
virtual std::string | getGroupName () const override |
|
virtual std::string | getName () const override |
|
virtual bool | initialize (moveit::core::RobotModelConstPtr robot_model_ptr, const std::string &group_name, XmlRpc::XmlRpcValue &config) override |
| Initializes and configures the Cost Function. More...
|
|
virtual bool | setMotionPlanRequest (const planning_scene::PlanningSceneConstPtr &planning_scene, const moveit_msgs::MotionPlanRequest &req, const stomp_core::StompConfiguration &config, moveit_msgs::MoveItErrorCodes &error_code) override |
| Stores the planning details which will be used during the costs calculations. More...
|
|
| ToolGoalPose () |
|
virtual | ~ToolGoalPose () |
|
virtual int | getOptimizedIndex () const |
|
virtual void | postIteration (std::size_t start_timestep, std::size_t num_timesteps, int iteration_number, double cost, const Eigen::MatrixXd ¶meters) |
|
Evaluates the cost of the goal pose by determining how far the Cartesian tool pose is from the desired under-constrained task manifold.
- Examples:
- All examples are located here STOMP Plugins Examples
Definition at line 47 of file tool_goal_pose.h.
stomp_moveit::cost_functions::ToolGoalPose::ToolGoalPose |
( |
| ) |
|
stomp_moveit::cost_functions::ToolGoalPose::~ToolGoalPose |
( |
| ) |
|
|
virtual |
bool stomp_moveit::cost_functions::ToolGoalPose::computeCosts |
( |
const Eigen::MatrixXd & |
parameters, |
|
|
std::size_t |
start_timestep, |
|
|
std::size_t |
num_timesteps, |
|
|
int |
iteration_number, |
|
|
int |
rollout_number, |
|
|
Eigen::VectorXd & |
costs, |
|
|
bool & |
validity |
|
) |
| |
|
overridevirtual |
computes the goal state costs as a function of the distance from the desired task manifold.
- Parameters
-
parameters | The parameter values to evaluate for state costs [num_dimensions x num_parameters] |
start_timestep | start index into the 'parameters' array, usually 0. |
num_timesteps | number of elements to use from 'parameters' starting from 'start_timestep' * |
iteration_number | The current iteration count in the optimization loop |
rollout_number | index of the noisy trajectory whose cost is being evaluated. * |
costs | vector containing the state costs per timestep. Only the array's last entry is set. [num_parameters x 1] |
validity | whether or not the trajectory is valid |
- Returns
- true if cost were properly computed
Implements stomp_moveit::cost_functions::StompCostFunction.
Definition at line 175 of file tool_goal_pose.cpp.
bool stomp_moveit::cost_functions::ToolGoalPose::configure |
( |
const XmlRpc::XmlRpcValue & |
config | ) |
|
|
overridevirtual |
void stomp_moveit::cost_functions::ToolGoalPose::done |
( |
bool |
success, |
|
|
int |
total_iterations, |
|
|
double |
final_cost, |
|
|
const Eigen::MatrixXd & |
parameters |
|
) |
| |
|
overridevirtual |
Called by the Stomp Task at the end of the optimization process.
- Parameters
-
success | Whether the optimization succeeded |
total_iterations | Number of iterations used |
final_cost | The cost value after optimizing. |
parameters | The parameters generated at the end of current iteration[num_dimensions x num_timesteps] |
Reimplemented from stomp_moveit::cost_functions::StompCostFunction.
Definition at line 230 of file tool_goal_pose.cpp.
virtual std::string stomp_moveit::cost_functions::ToolGoalPose::getGroupName |
( |
| ) |
const |
|
inlineoverridevirtual |
virtual std::string stomp_moveit::cost_functions::ToolGoalPose::getName |
( |
| ) |
const |
|
inlineoverridevirtual |
bool stomp_moveit::cost_functions::ToolGoalPose::initialize |
( |
moveit::core::RobotModelConstPtr |
robot_model_ptr, |
|
|
const std::string & |
group_name, |
|
|
XmlRpc::XmlRpcValue & |
config |
|
) |
| |
|
overridevirtual |
Initializes and configures the Cost Function.
- Parameters
-
robot_model_ptr | A pointer to the robot model. |
group_name | The designated planning group. |
config | The configuration data. Usually loaded from the ros parameter server |
- Returns
- true if succeeded, false otherwise.
Implements stomp_moveit::cost_functions::StompCostFunction.
Definition at line 57 of file tool_goal_pose.cpp.
std::string stomp_moveit::cost_functions::ToolGoalPose::group_name_ |
|
protected |
Eigen::VectorXd stomp_moveit::cost_functions::ToolGoalPose::last_joint_pose_ |
|
protected |
Eigen::Affine3d stomp_moveit::cost_functions::ToolGoalPose::last_tool_pose_ |
|
protected |
Eigen::VectorXd stomp_moveit::cost_functions::ToolGoalPose::max_twist_error_ |
|
protected |
Eigen::VectorXd stomp_moveit::cost_functions::ToolGoalPose::min_twist_error_ |
|
protected |
std::string stomp_moveit::cost_functions::ToolGoalPose::name_ |
|
protected |
double stomp_moveit::cost_functions::ToolGoalPose::orientation_cost_weight_ |
|
protected |
factor multiplied to the scaled orientation error
Definition at line 146 of file tool_goal_pose.h.
planning_scene::PlanningSceneConstPtr stomp_moveit::cost_functions::ToolGoalPose::planning_scene_ |
|
protected |
double stomp_moveit::cost_functions::ToolGoalPose::position_cost_weight_ |
|
protected |
factor multiplied to the scaled position error
Definition at line 145 of file tool_goal_pose.h.
moveit::core::RobotModelConstPtr stomp_moveit::cost_functions::ToolGoalPose::robot_model_ |
|
protected |
moveit::core::RobotStatePtr stomp_moveit::cost_functions::ToolGoalPose::state_ |
|
protected |
Eigen::Affine3d stomp_moveit::cost_functions::ToolGoalPose::tool_goal_pose_ |
|
protected |
The desired goal pose for the active plan request.
Definition at line 139 of file tool_goal_pose.h.
Eigen::VectorXd stomp_moveit::cost_functions::ToolGoalPose::tool_goal_tolerance_ |
|
protected |
std::string stomp_moveit::cost_functions::ToolGoalPose::tool_link_ |
|
protected |
Eigen::VectorXd stomp_moveit::cost_functions::ToolGoalPose::tool_twist_error_ |
|
protected |
The documentation for this class was generated from the following files: