CRegistrationDeciderOrOptimizer_ROS.h
Go to the documentation of this file.
1 #pragma once
2 
3 #include <ros/ros.h>
4 
5 #include <mrpt/utils/COutputLogger.h>
6 #include <mrpt/graphslam/interfaces/CRegistrationDeciderOrOptimizer.h>
7 
8 namespace mrpt { namespace graphslam {
9 
15 template<class GRAPH_t=typename mrpt::graphs::CNetworkOfPoses2DInf>
17  public virtual mrpt::graphslam::CRegistrationDeciderOrOptimizer<GRAPH_t>
18 {
19 public:
22 
23  virtual void setNodeHandle(ros::NodeHandle* nh);
24 
25 protected:
29 
30 
31 };
32 
33 
34 } } // end of namespaces
35 
37 
Interface class that all ROS-specific deciders/optimizers can inherit from.


mrpt_graphslam_2d
Author(s): Nikos Koukis
autogenerated on Thu Jun 6 2019 19:37:48