joint_limits.h
Go to the documentation of this file.
1 
26 #ifndef INDUSTRIAL_MOVEIT_STOMP_MOVEIT_INCLUDE_STOMP_MOVEIT_NOISY_FILTERS_JOINT_LIMITS_H_
27 #define INDUSTRIAL_MOVEIT_STOMP_MOVEIT_INCLUDE_STOMP_MOVEIT_NOISY_FILTERS_JOINT_LIMITS_H_
28 
30 #include <moveit_msgs/GetMotionPlan.h>
32 
33 namespace stomp_moveit
34 {
35 namespace noisy_filters
36 {
47 {
48 public:
49  JointLimits();
50  virtual ~JointLimits();
51 
53  virtual bool initialize(moveit::core::RobotModelConstPtr robot_model_ptr,
54  const std::string& group_name,const XmlRpc::XmlRpcValue& config) override;
55 
57  virtual bool configure(const XmlRpc::XmlRpcValue& config) override;
58 
60  virtual bool setMotionPlanRequest(const planning_scene::PlanningSceneConstPtr& planning_scene,
61  const moveit_msgs::MotionPlanRequest &req,
62  const stomp_core::StompConfiguration &config,
63  moveit_msgs::MoveItErrorCodes& error_code) override;
64 
65 
66  virtual std::string getGroupName() const override
67  {
68  return group_name_;
69  }
70 
71  virtual std::string getName() const override
72  {
73  return "JointLimits/" + group_name_;
74  }
75 
87  virtual bool filter(std::size_t start_timestep,
88  std::size_t num_timesteps,
89  int iteration_number,
90  int rollout_number,
91  Eigen::MatrixXd& parameters,
92  bool& filtered) override;
93 
94 protected:
95 
96  moveit::core::RobotModelConstPtr robot_model_;
97  std::string group_name_;
98 
99  // options
100  bool lock_start_;
101  bool lock_goal_;
102  bool has_goal_constraints_;
104  // start and goal
105  moveit::core::RobotStatePtr start_state_;
106  moveit::core::RobotStatePtr goal_state_;
107 
108 
109 };
110 
111 } /* namespace filters */
112 } /* namespace stomp_moveit */
113 
114 #endif /* INDUSTRIAL_MOVEIT_STOMP_MOVEIT_INCLUDE_STOMP_MOVEIT_NOISY_FILTERS_JOINT_LIMITS_H_ */
Interface class for filtering noisy trajectories.
virtual bool initialize(moveit::core::RobotModelConstPtr robot_model_ptr, const std::string &group_name, const XmlRpc::XmlRpcValue &config) override
see base class for documentation
This is the base class for all stomp filters.
moveit::core::RobotStatePtr start_state_
True if a joint constraint for the goal was provided.
Definition: joint_limits.h:105
virtual bool filter(std::size_t start_timestep, std::size_t num_timesteps, int iteration_number, int rollout_number, Eigen::MatrixXd &parameters, bool &filtered) override
Sets the joint values to the closest joint limit whenever it&#39;s found outside the allowed range...
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
see base class for documentation
Checks that the joint values are within the limits as defined in the urdf file. It modifies the value...
Definition: joint_limits.h:46
virtual bool configure(const XmlRpc::XmlRpcValue &config) override
see base class for documentation


stomp_moveit
Author(s): Jorge Nicho
autogenerated on Fri May 8 2020 03:35:47