#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.
Define Documentation
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)
Definition at line 43 of file type.h.