#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.
Namespaces | |
namespace | stdr_parser |
The main namespace for STDR GUI XML parser. | |
Defines | |
#define | SSTR(x) |
< Transforms a float number to string | |
Functions | |
std::set< std::string > | stdr_parser::explodeString (std::string s, char delimiter) |
Explodes a string based on a delimiter. | |
std::string | stdr_parser::extractDirname (std::string s) |
Extracts the directory from an absolute path. It does the same functionality as libgen's dirname but for std::string objects. | |
std::string | stdr_parser::extractFilename (std::string s) |
Extracts the filename from an absolute path. |
#define SSTR | ( | x | ) |
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.