26 #ifndef INDUSTRIAL_MOVEIT_STOMP_MOVEIT_INCLUDE_STOMP_MOVEIT_NOISY_FILTERS_MULTI_TRAJECTORY_VISUALIZATION_H_ 27 #define INDUSTRIAL_MOVEIT_STOMP_MOVEIT_INCLUDE_STOMP_MOVEIT_NOISY_FILTERS_MULTI_TRAJECTORY_VISUALIZATION_H_ 32 #include <visualization_msgs/MarkerArray.h> 33 #include <geometry_msgs/Point.h> 38 namespace noisy_filters
56 virtual bool initialize(moveit::core::RobotModelConstPtr robot_model_ptr,
64 const moveit_msgs::MotionPlanRequest &req,
66 moveit_msgs::MoveItErrorCodes& error_code)
override;
79 virtual bool filter(std::size_t start_timestep,
80 std::size_t num_timesteps,
83 Eigen::MatrixXd& parameters,
84 bool& filtered)
override;
87 virtual std::string getName()
const override 89 return name_ +
"/" + group_name_;
92 virtual std::string getGroupName()
const override 103 std::string group_name_;
104 moveit::core::RobotModelConstPtr robot_model_;
105 moveit::core::RobotStatePtr state_;
113 std_msgs::ColorRGBA rgb_;
114 std::string marker_topic_;
115 std::string marker_namespace_;
118 std::size_t traj_total_;
119 Eigen::MatrixXd tool_traj_line_;
120 visualization_msgs::MarkerArray tool_traj_markers_;
121 visualization_msgs::MarkerArray tool_points_markers_;
Interface class for filtering noisy trajectories.
Publishes rviz markers to visualize the noisy trajectories.
virtual bool configure(const XmlRpc::XmlRpcValue &config) override
see base class for documentation
This is the base class for all stomp filters.
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
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
Creates rviz markers for visualizing the noisy trajectories, it does not change the parameters...
virtual bool initialize(moveit::core::RobotModelConstPtr robot_model_ptr, const std::string &group_name, const XmlRpc::XmlRpcValue &config) override
see base class for documentation