Namespaces | Functions
parser.cpp File Reference
#include <boost/algorithm/string.hpp>
#include <boost/utility/string_ref.hpp>
#include <boost/lexical_cast.hpp>
#include <ros/ros.h>
#include <iostream>
#include <sstream>
#include <functional>
#include <boost/regex.hpp>
#include <boost/algorithm/string/regex.hpp>
#include "ros_type_introspection/parser.hpp"
Include dependency graph for parser.cpp:

Go to the source code of this file.

Namespaces

namespace  RosIntrospection

Functions

ROSTypeList RosIntrospection::buildROSTypeMapFromDefinition (const std::string &type_name, const std::string &msg_definition)
 A single message definition will (most probably) generate myltiple ROSMessage(s). In fact the "child" ROSTypes are parsed as well in a recursive and hierarchical way. To make an example, given as input the [geometry_msgs/Pose](http://docs.ros.org/kinetic/api/geometry_msgs/html/msg/Pose.html) the result will be a ROSTypeList containing Pose, Point and Quaternion.
bool RosIntrospection::isSeparator (const std::string &line)
std::ostream & RosIntrospection::operator<< (std::ostream &s, const ROSTypeList &c)
SString RosIntrospection::strippedTypeName (const boost::string_ref &line)


ros_type_introspection
Author(s): Davide Faconti
autogenerated on Sun Oct 1 2017 02:54:53