19 #ifndef SLAM_TOOLBOX_SLAM_TOOLBOX_LOCALIZATION_H_ 
   20 #define SLAM_TOOLBOX_SLAM_TOOLBOX_LOCALIZATION_H_ 
   23 #include "std_srvs/Empty.h" 
   28 using namespace ::
karto;
 
   38     const sensor_msgs::LaserScan::ConstPtr& scan) 
override final;
 
   40     const geometry_msgs::PoseWithCovarianceStampedConstPtr& msg);
 
   43     std_srvs::Empty::Request& req,
 
   44     std_srvs::Empty::Response& resp);
 
   46     slam_toolbox_msgs::SerializePoseGraph::Request& req,
 
   47     slam_toolbox_msgs::SerializePoseGraph::Response& resp) 
override final;
 
   49     slam_toolbox_msgs::DeserializePoseGraph::Request& req,
 
   50     slam_toolbox_msgs::DeserializePoseGraph::Response& resp) 
override final;
 
   53     const sensor_msgs::LaserScan::ConstPtr& scan,
 
   62 #endif //SLAM_TOOLBOX_SLAM_TOOLBOX_LOCALIZATION_H_