Class template that provides a wrapper around the MRPT CGraphSlamEngine class template and implements methods for interacting with ROS. More...
#include <CGraphSlamEngine_ROS.h>
Public Types | |
typedef CGraphSlamEngine< GRAPH_t > | parent |
Public Member Functions | |
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 | initClass () |
Initialize object instance. More... | |
void | setupComm () |
Wrapper method around the protected setup* class methods. More... | |
virtual | ~CGraphSlamEngine_ROS () |
Public Attributes | |
ros::NodeHandle * | m_nh |
Protected Member Functions | |
virtual bool | _execGraphSlamStep (mrpt::obs::CActionCollection::Ptr &action, mrpt::obs::CSensoryFrame::Ptr &observations, mrpt::obs::CObservation::Ptr &observation, size_t &rawlog_entry) |
void | readParams () |
Read the problem configuration parameters. More... | |
void | readROSParameters () |
Read configuration parameters from the ROS parameter server. More... | |
virtual void | usePublishersBroadcasters () |
Provide feedback about the SLAM operation. More... | |
setup* ROS-related methods | |
Methods for setting up topic subscribers, publishers, and corresponding services
| |
virtual void | setupSubs () |
virtual void | setupPubs () |
virtual void | setupSrvs () |
Protected Attributes | |
ros::CallbackQueue | custom_service_queue |
Custom Callback queue for processing requests for the services outside the standard CallbackQueue. More... | |
int | m_queue_size |
Class template that provides a wrapper around the MRPT CGraphSlamEngine class template and implements methods for interacting with ROS.
Definition at line 25 of file CGraphSlamEngine_ROS.h.
typedef CGraphSlamEngine<GRAPH_t> mrpt::graphslam::CGraphSlamEngine_ROS< GRAPH_t >::parent |
Definition at line 28 of file CGraphSlamEngine_ROS.h.
mrpt::graphslam::CGraphSlamEngine_ROS< GRAPH_t >::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 |
||
) |
Definition at line 14 of file CGraphSlamEngine_ROS_impl.h.
|
virtual |
Definition at line 37 of file CGraphSlamEngine_ROS_impl.h.
|
protectedvirtual |
Reimplemented in mrpt::graphslam::CGraphSlamEngine_MR< GRAPH_T >.
Definition at line 91 of file CGraphSlamEngine_ROS_impl.h.
void mrpt::graphslam::CGraphSlamEngine_ROS< GRAPH_t >::initClass | ( | ) |
Initialize object instance.
Definition at line 43 of file CGraphSlamEngine_ROS_impl.h.
|
protected |
Read the problem configuration parameters.
Definition at line 82 of file CGraphSlamEngine_ROS_impl.h.
|
protected |
Read configuration parameters from the ROS parameter server.
Definition at line 88 of file CGraphSlamEngine_ROS_impl.h.
void mrpt::graphslam::CGraphSlamEngine_ROS< GRAPH_t >::setupComm | ( | ) |
Wrapper method around the protected setup* class methods.
Handy for setting up publishers, subscribers, services all at once.
Definition at line 108 of file CGraphSlamEngine_ROS_impl.h.
|
protectedvirtual |
Reimplemented in mrpt::graphslam::CGraphSlamEngine_MR< GRAPH_T >.
Definition at line 126 of file CGraphSlamEngine_ROS_impl.h.
|
protectedvirtual |
Reimplemented in mrpt::graphslam::CGraphSlamEngine_MR< GRAPH_T >.
Definition at line 132 of file CGraphSlamEngine_ROS_impl.h.
|
protectedvirtual |
Reimplemented in mrpt::graphslam::CGraphSlamEngine_MR< GRAPH_T >.
Definition at line 120 of file CGraphSlamEngine_ROS_impl.h.
|
protectedvirtual |
Provide feedback about the SLAM operation.
Method makes the necessary calls to all the publishers of the class and broadcaster instances
Reimplemented in mrpt::graphslam::CGraphSlamEngine_MR< GRAPH_T >.
Definition at line 105 of file CGraphSlamEngine_ROS_impl.h.
|
protected |
Custom Callback queue for processing requests for the services outside the standard CallbackQueue.
Definition at line 97 of file CGraphSlamEngine_ROS.h.
ros::NodeHandle* mrpt::graphslam::CGraphSlamEngine_ROS< GRAPH_t >::m_nh |
Definition at line 51 of file CGraphSlamEngine_ROS.h.
|
protected |
Definition at line 100 of file CGraphSlamEngine_ROS.h.