17 namespace mrpt {
namespace graphslam {
24 template<
class GRAPH_t=
typename mrpt::graphs::CNetworkOfPoses2DInf>
32 const std::string& config_file,
33 const std::string& rawlog_fname=
"",
34 const std::string& fname_GT=
"",
71 mrpt::obs::CActionCollection::Ptr& action,
72 mrpt::obs::CSensoryFrame::Ptr& observations,
73 mrpt::obs::CObservation::Ptr& observation,
74 size_t& rawlog_entry);
virtual ~CGraphSlamEngine_ROS()
CGraphSlamEngine< GRAPH_t > parent
CGraphSlamEngine_ROS(ros::NodeHandle *nh, const std::string &config_file, const std::string &rawlog_fname="", const std::string &fname_GT="", mrpt::graphslam::CWindowManager *win_manager=NULL, mrpt::graphslam::deciders::CNodeRegistrationDecider< GRAPH_t > *node_reg=NULL, mrpt::graphslam::deciders::CEdgeRegistrationDecider< GRAPH_t > *edge_reg=NULL, mrpt::graphslam::optimizers::CGraphSlamOptimizer< GRAPH_t > *optimizer=NULL)
void readParams()
Read the problem configuration parameters.
virtual bool _execGraphSlamStep(mrpt::obs::CActionCollection::Ptr &action, mrpt::obs::CSensoryFrame::Ptr &observations, mrpt::obs::CObservation::Ptr &observation, size_t &rawlog_entry)
ros::CallbackQueue custom_service_queue
Custom Callback queue for processing requests for the services outside the standard CallbackQueue...
virtual void usePublishersBroadcasters()
Provide feedback about the SLAM operation.
void initClass()
Initialize object instance.
void readROSParameters()
Read configuration parameters from the ROS parameter server.
void setupComm()
Wrapper method around the protected setup* class methods.
Class template that provides a wrapper around the MRPT CGraphSlamEngine class template and implements...