#include <iostream>
#include <cstdlib>
#include <map>
#include <vector>
#include <string>
#include <sstream>
#include <fstream>
#include <ros/package.h>
#include "ros/ros.h"
#include <tinyxml.h>
#include "yaml-cpp/yaml.h"
#include "stdr_msgs/RobotMsg.h"
#include "geometry_msgs/Pose2D.h"
#include "geometry_msgs/Point.h"
#include "stdr_parser/stdr_parser_exceptions.h"
Go to the source code of this file.
|
| stdr_parser |
| The main namespace for STDR GUI XML parser.
|
|
|
#define | SSTR(x) |
| < Transforms a float number to string More...
|
|
Value:dynamic_cast< std::ostringstream & >( \
( std::ostringstream() << std::dec << x ) ).str()
< Transforms a float number to string
Definition at line 59 of file stdr_parser_tools.h.