Go to the documentation of this file.
12 #include <mrpt/system/COutputLogger.h>
13 #include <mrpt/graphslam/CGraphSlamEngine.h>
14 #include <mrpt/system/string_utils.h>
23 using namespace mrpt::poses;
24 using namespace mrpt::obs;
25 using namespace mrpt::system;
26 using namespace mrpt::graphs;
28 using namespace mrpt::opengl;
37 int main(
int argc,
char** argv)
39 std::string node_name =
"mrpt_graphslam_2d";
42 logger.setLoggerName(node_name);
43 logger.logFmt(LVL_WARN,
"Initializing %s node...\n", node_name.c_str());
55 &
logger, &options_checker, &nh);
63 bool cont_exec =
true;
75 "Finished with a (known) exception!" << std::endl
76 << e.what() << std::endl);
77 mrpt::system::pause();
83 mrpt::system::pause();
void readParams()
Read the problem configuration parameters.
#define ROS_ERROR_STREAM(args)
void printParams()
Print in a compact manner the overall problem configuration parameters.
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
Manage variables, ROS parameters and everything else related to the graphslam-engine ROS wrapper.
void initEngine_ROS()
Initialize the CGraphslamEngine_* object.
ROSCPP_DECL void spinOnce()
int main(int argc, char **argv)
bool usePublishersBroadcasters()
Provide feedback about the SLAM operation using ROS publilshers, update the registered frames using t...
void setupComm()
Wrapper method around the protected setup* class methods.