$search
#include <introspection/forwards.h>#include <boost/any.hpp>#include <boost/enable_shared_from_this.hpp>#include <boost/lexical_cast.hpp>#include <ros/time.h>#include <ros/console.h>#include <std_msgs/String.h>#include <std_msgs/Bool.h>#include <introspection/conversion.h>

Go to the source code of this file.
Classes | |
| class | cpp_introspection::BoolType |
| class | cpp_introspection::DurationType |
| class | cpp_introspection::NumericType< T > |
| struct | cpp_introspection::Type::StaticInitializer |
| class | cpp_introspection::StringType |
| class | cpp_introspection::TimeType |
| class | cpp_introspection::Type |
| struct | cpp_introspection::UnknownType |
Namespaces | |
| namespace | cpp_introspection |
Defines | |
| #define | CATCH_BAD_CAST_EXCEPTION_AND_RETURN(return_value, default_value) |
Functions | |
| TypePtr | cpp_introspection::type (const std::string &name) |
| #define CATCH_BAD_CAST_EXCEPTION_AND_RETURN | ( | return_value, | |||
| default_value | ) |
try { \ return return_value; \ } catch (boost::bad_any_cast&) { \ ROS_WARN_NAMED("cpp_introspection", "bad_any_cast exception while trying to convert a value of type %s", getName()); \ return default_value; \ } catch (boost::bad_lexical_cast&) { \ return default_value; \ } while(0)