This is the base class for all stomp cost functions. More...
#include <string>
#include <XmlRpc.h>
#include <stomp_core/utils.h>
#include <moveit_msgs/GetMotionPlan.h>
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_trajectory/robot_trajectory.h>
#include <moveit/planning_scene/planning_scene.h>
Go to the source code of this file.
Classes | |
class | stomp_moveit::cost_functions::StompCostFunction |
Assigns a cost value to each robot state by evaluating the minimum distance between the robot and the nearest obstacle. More... | |
Namespaces | |
namespace | stomp_moveit |
namespace | stomp_moveit::cost_functions |
Typedefs | |
typedef boost::shared_ptr < StompCostFunction > | stomp_moveit::cost_functions::StompCostFunctionPtr |
This is the base class for all stomp cost functions.
Definition in file stomp_cost_function.h.