11 namespace mrpt {
namespace graphslam {
13 template<
class GRAPH_t>
16 const std::string& config_file,
17 const std::string& rawlog_fname,
18 const std::string& fname_GT ,
19 mrpt::graphslam::CWindowManager* win_manager ,
20 mrpt::graphslam::deciders::CNodeRegistrationDecider<GRAPH_t>* node_reg ,
21 mrpt::graphslam::deciders::CEdgeRegistrationDecider<GRAPH_t>* edge_reg ,
22 mrpt::graphslam::optimizers::CGraphSlamOptimizer<GRAPH_t>* optimizer ):
36 template<
class GRAPH_t>
38 MRPT_LOG_DEBUG_STREAM(
"In Destructor: Deleting CGraphSlamEngine_ROS instance...");
42 template<
class GRAPH_t>
45 this->m_class_name =
"CGraphSlamEngine_ROS";
46 this->setLoggerName(this->m_class_name);
81 template<
class GRAPH_t>
87 template<
class GRAPH_t>
90 template<
class GRAPH_t>
92 mrpt::obs::CActionCollection::Ptr& action,
93 mrpt::obs::CSensoryFrame::Ptr& observations,
94 mrpt::obs::CObservation::Ptr& observation,
95 size_t& rawlog_entry) {
97 bool continue_exec = parent::_execGraphSlamStep(
98 action, observations, observation, rawlog_entry);
101 return continue_exec;
104 template<
class GRAPH_t>
107 template<
class GRAPH_t>
109 MRPT_LOG_INFO_STREAM(
110 "Setting up subscribers, publishers, services...");
119 template<
class GRAPH_t>
121 MRPT_LOG_DEBUG_STREAM(
"Setting up subscribers...");
125 template<
class GRAPH_t>
127 MRPT_LOG_DEBUG_STREAM(
"Setting up publishers...");
131 template<
class GRAPH_t>
133 MRPT_LOG_DEBUG_STREAM(
"Setting up services...");
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)
virtual void usePublishersBroadcasters()
Provide feedback about the SLAM operation.
ROSCPP_DECL void shutdown()
Interface class that all ROS-specific deciders/optimizers can inherit from.
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.
virtual void setNodeHandle(ros::NodeHandle *nh)