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 | ) |
Definition at line 40 of file color_utils.cpp.
double jsk_topic_tools::getXMLDoubleValue | ( | XmlRpc::XmlRpcValue | val | ) |
Definition at line 40 of file rosparam_utils.cpp.
std_msgs::ColorRGBA jsk_topic_tools::heatColor | ( | double | v | ) |
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 59 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 82 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 155 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 116 of file rosparam_utils.cpp.
const std::string jsk_topic_tools::g_none_topic = "__none" [static] |
Definition at line 42 of file mux_nodelet.cpp.