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_ 30 #include <moveit_msgs/GetMotionPlan.h> 35 namespace noisy_filters
53 virtual bool initialize(moveit::core::RobotModelConstPtr robot_model_ptr,
61 const moveit_msgs::MotionPlanRequest &req,
63 moveit_msgs::MoveItErrorCodes& error_code)
override;
66 virtual std::string getGroupName()
const override 71 virtual std::string getName()
const override 73 return "JointLimits/" + group_name_;
87 virtual bool filter(std::size_t start_timestep,
88 std::size_t num_timesteps,
91 Eigen::MatrixXd& parameters,
92 bool& filtered)
override;
96 moveit::core::RobotModelConstPtr robot_model_;
97 std::string group_name_;
102 bool has_goal_constraints_;
106 moveit::core::RobotStatePtr goal_state_;
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.
virtual bool filter(std::size_t start_timestep, std::size_t num_timesteps, int iteration_number, int rollout_number, Eigen::MatrixXd ¶meters, bool &filtered) override
Sets the joint values to the closest joint limit whenever it'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...
virtual bool configure(const XmlRpc::XmlRpcValue &config) override
see base class for documentation