Namespaces | |
| namespace | log_utils |
| namespace | master_util |
| namespace | name_utils |
| namespace | test |
| namespace | transport |
Classes | |
| class | Block |
| class | ConnectionBasedNodelet |
| Nodelet to automatically subscribe/unsubscribe topics according to subscription of advertised topics. More... | |
| class | Counter |
| class | DeprecatedRelay |
| class | DiagnosticNodelet |
| Nodelet class based on ConnectionBasedNodelet and publish diagnostic infromation periodicaly. More... | |
| class | HzMeasure |
| class | LightweightThrottle |
| class | MUX |
| class | Passthrough |
| class | PoseStampedTransformer |
| class | Relay |
| class | ScopedTimer |
| class | SeriesBoolean |
| class | Snapshot |
| class | StealthRelay |
| class | StringRelay |
| class | TimeAccumulator |
| class | TimeredDiagnosticUpdater |
| class | VitalChecker |
| class | VitalCheckerNodelet |
Enumerations | |
| enum | ConnectionStatus { NOT_INITIALIZED, NOT_SUBSCRIBED, SUBSCRIBED } |
| Enum to represent connection status. More... | |
Functions | |
| void | addDiagnosticBooleanStat (const std::string &string_prefix, const bool value, diagnostic_updater::DiagnosticStatusWrapper &stat) |
| void | addDiagnosticErrorSummary (const std::string &string_prefix, jsk_topic_tools::VitalChecker::Ptr vital_checker, diagnostic_updater::DiagnosticStatusWrapper &stat) |
| void | addDiagnosticInformation (const std::string &string_prefix, jsk_topic_tools::TimeAccumulator &accumulator, diagnostic_updater::DiagnosticStatusWrapper &stat) |
| std_msgs::ColorRGBA | colorCategory20 (int i) |
| choose a color out of 20 good selected colors | |
| const std::string | getFunctionName (const std::string &name) |
| Get only function name from __PRETTY_FUNCTION__. | |
| double | getXMLDoubleValue (XmlRpc::XmlRpcValue val) |
| std_msgs::ColorRGBA | heatColor (double v) |
| returns heat-map color (http://en.wikipedia.org/wiki/Heat_map) | |
| bool | readVectorParameter (ros::NodeHandle &nh, const std::string ¶m_name, std::vector< double > &result) |
| bool | readVectorParameter (ros::NodeHandle &nh, const std::string ¶m_name, std::vector< std::vector< double > > &result) |
| bool | readVectorParameter (ros::NodeHandle &nh, const std::string ¶m_name, std::vector< std::string > &result) |
| bool | readVectorParameter (ros::NodeHandle &nh, const std::string ¶m_name, std::vector< std::vector< std::string > > &result) |
| bool | warnNoRemap (const std::vector< std::string > names) |
| warn if there are expected remappings. | |
Variables | |
| static const std::string | g_none_topic = "__none" |
Enum to represent connection status.
Definition at line 51 of file connection_based_nodelet.h.
| void jsk_topic_tools::addDiagnosticBooleanStat | ( | const std::string & | string_prefix, |
| const bool | value, | ||
| diagnostic_updater::DiagnosticStatusWrapper & | stat | ||
| ) |
Definition at line 66 of file diagnostic_utils.cpp.
| void jsk_topic_tools::addDiagnosticErrorSummary | ( | const std::string & | string_prefix, |
| jsk_topic_tools::VitalChecker::Ptr | vital_checker, | ||
| diagnostic_updater::DiagnosticStatusWrapper & | stat | ||
| ) |
Definition at line 55 of file diagnostic_utils.cpp.
| void jsk_topic_tools::addDiagnosticInformation | ( | const std::string & | string_prefix, |
| jsk_topic_tools::TimeAccumulator & | accumulator, | ||
| diagnostic_updater::DiagnosticStatusWrapper & | stat | ||
| ) |
Definition at line 41 of file diagnostic_utils.cpp.
| std_msgs::ColorRGBA jsk_topic_tools::colorCategory20 | ( | int | i | ) |
choose a color out of 20 good selected colors
The color format is same as d3.js (https://github.com/mbostock/d3/wiki/Ordinal-Scales#category20)
| [in] | i | index value |
Definition at line 40 of file color_utils.cpp.
| const std::string jsk_topic_tools::getFunctionName | ( | const std::string & | name | ) |
Get only function name from __PRETTY_FUNCTION__.
| [in] | name | std::string from which only function name is extracted |
Definition at line 62 of file log_utils.cpp.
| double jsk_topic_tools::getXMLDoubleValue | ( | XmlRpc::XmlRpcValue | val | ) |
Definition at line 41 of file rosparam_utils.cpp.
| std_msgs::ColorRGBA jsk_topic_tools::heatColor | ( | double | v | ) |
returns heat-map color (http://en.wikipedia.org/wiki/Heat_map)
| [in] | v | Value to colorize. This should be in [0.0:1.0] |
Definition at line 189 of file color_utils.cpp.
| bool jsk_topic_tools::readVectorParameter | ( | ros::NodeHandle & | nh, |
| const std::string & | param_name, | ||
| std::vector< double > & | result | ||
| ) |
Definition at line 61 of file rosparam_utils.cpp.
| bool jsk_topic_tools::readVectorParameter | ( | ros::NodeHandle & | nh, |
| const std::string & | param_name, | ||
| std::vector< std::vector< double > > & | result | ||
| ) |
Definition at line 84 of file rosparam_utils.cpp.
| bool jsk_topic_tools::readVectorParameter | ( | ros::NodeHandle & | nh, |
| const std::string & | param_name, | ||
| std::vector< std::string > & | result | ||
| ) |
Definition at line 157 of file rosparam_utils.cpp.
| bool jsk_topic_tools::readVectorParameter | ( | ros::NodeHandle & | nh, |
| const std::string & | param_name, | ||
| std::vector< std::vector< std::string > > & | result | ||
| ) |
Definition at line 118 of file rosparam_utils.cpp.
| bool jsk_topic_tools::warnNoRemap | ( | const std::vector< std::string > | names | ) |
warn if there are expected remappings.
| [in] | names | Names which are expected to remapped. |
Definition at line 44 of file log_utils.cpp.
const std::string jsk_topic_tools::g_none_topic = "__none" [static] |
Definition at line 42 of file mux_nodelet.cpp.