26 #ifndef INDUSTRIAL_MOVEIT_STOMP_MOVEIT_INCLUDE_STOMP_MOVEIT_UPDATE_FILTERS_UPDATE_LOGGER_H_    27 #define INDUSTRIAL_MOVEIT_STOMP_MOVEIT_INCLUDE_STOMP_MOVEIT_UPDATE_FILTERS_UPDATE_LOGGER_H_    34 namespace update_filters
    54   virtual bool initialize(moveit::core::RobotModelConstPtr robot_model_ptr,
    62                    const moveit_msgs::MotionPlanRequest &req,
    64                    moveit_msgs::MoveItErrorCodes& error_code);
    77   virtual bool filter(std::size_t start_timestep,
    78                       std::size_t num_timesteps,
    80                       const Eigen::MatrixXd& parameters,
    81                       Eigen::MatrixXd& updates,
    82                       bool& filtered) 
override;
    84   virtual std::string getGroupName()
 const override    89   virtual std::string getName()
 const override    91     return name_ + 
"/" + group_name_;
    94   virtual void done(
bool success, 
int total_iterations,
double final_cost,
const Eigen::MatrixXd& parameters) 
override;
    99   std::string group_name_;
   102   std::string filename_;
   103   std::string package_;
   104   std::string directory_;
   110   std::stringstream stream_;
   111   std::string full_file_name_;
   112   std::ofstream file_stream_;
   113   Eigen::IOFormat format_;
 
virtual bool filter(std::size_t start_timestep, std::size_t num_timesteps, int iteration_number, const Eigen::MatrixXd ¶meters, Eigen::MatrixXd &updates, bool &filtered) override
Store the updates values into a file that can be loaded into a numpy array. 
virtual bool configure(const XmlRpc::XmlRpcValue &config)
see base class for documentation 
Interface class which applies filtering methods to the update parameters before it is added onto the ...
virtual bool setMotionPlanRequest(const planning_scene::PlanningSceneConstPtr &planning_scene, const moveit_msgs::MotionPlanRequest &req, const stomp_core::StompConfiguration &config, moveit_msgs::MoveItErrorCodes &error_code)
see base class for documentation 
virtual bool initialize(moveit::core::RobotModelConstPtr robot_model_ptr, const std::string &group_name, const XmlRpc::XmlRpcValue &config)
see base class for documentation 
Saves the update values into a file for post analysis. The file is compatible with the python numpy l...
virtual void done(bool success, int total_iterations, double final_cost, const Eigen::MatrixXd ¶meters) override
Called by the Stomp at the end of the optimization process. 
This is the base class for all stomp update filters.