utils.h
Go to the documentation of this file.
1 
18 #ifndef GAZEBO_VIDEO_MONITOR_PLUGINS_INTERNAL_UTILS_H
19 #define GAZEBO_VIDEO_MONITOR_PLUGINS_INTERNAL_UTILS_H
20 
21 #include <cxxabi.h>
22 #include <chrono>
23 #include <ctime>
24 #include <memory>
25 #include <sstream>
26 #include <string>
27 #include <vector>
28 
29 #include <boost/filesystem/operations.hpp>
30 
31 #include <ros/ros.h>
32 
33 #include <sdf/Element.hh>
34 
36 
37 template <typename ClassName>
38 static std::string getClassName() {
39  int status;
40  std::string name = std::string(
41  abi::__cxa_demangle(typeid(ClassName).name(), nullptr, nullptr, &status));
42  auto pos = name.rfind("::");
43  if (pos == std::string::npos) return name;
44  return name.substr(name.rfind("::") + 2);
45 }
46 
47 static bool createDirectory(const boost::filesystem::path &path) {
48  if (not boost::filesystem::exists(path)) {
49  if (not boost::filesystem::create_directory(path)) return false;
50  ROS_INFO_STREAM(path << " directory has been created");
51  }
52  return true;
53 }
54 
55 namespace internal {
56 
57 static void parseRefModelConfig(const sdf::ElementPtr &sdf,
58  const RefModelConfigPtr &config) {
59  if (sdf->HasElement("model") and config->model_name.empty())
60  config->model_name = sdf->Get<std::string>("model");
61  if (sdf->HasElement("link"))
62  config->link_name = sdf->Get<std::string>("link");
63 }
64 
65 } // namespace internal
66 
74 static RefModelConfigConstPtr parseRefModelConfig(const sdf::ElementPtr &sdf) {
75  RefModelConfigPtr config = std::make_shared<RefModelConfig>();
76  internal::parseRefModelConfig(sdf, config);
77  return std::move(config);
78 }
79 
90 static RefModelConfigConstPtr parseRefModelConfig(const sdf::ElementPtr &sdf,
91  ros::NodeHandle &nh) {
92  RefModelConfigPtr config = std::make_shared<RefModelConfig>();
93  if (sdf->HasElement("modelParam")) {
94  auto model_param = sdf->Get<std::string>("modelParam");
95  if (not nh.getParam(model_param, config->model_name))
96  ROS_WARN_STREAM("Failed to retrieve " << model_param << " parameter");
97  }
98  internal::parseRefModelConfig(sdf, config);
99  return std::move(config);
100 }
101 
102 static std::string getStringTimestamp(std::time_t t) {
103  std::tm tm = *std::localtime(&t);
104  std::stringstream ss;
105  ss << std::put_time(&tm, "%Y-%m-%d-%H-%M-%S");
106  return ss.str();
107 }
108 
109 static std::string toString(const std::vector<std::string> &names,
110  const std::string &delimiter = ", ") {
111  std::stringstream ss;
112  for (size_t i = 0; i < names.size(); ++i) {
113  ss << names[i];
114  if (i < names.size() - 1) ss << delimiter;
115  }
116  return ss.str();
117 }
118 
119 #endif // GAZEBO_VIDEO_MONITOR_PLUGINS_INTERNAL_UTILS_H
toString
static std::string toString(const std::vector< std::string > &names, const std::string &delimiter=", ")
Definition: utils.h:109
types.h
ros::NodeHandle::getParam
bool getParam(const std::string &key, bool &b) const
ros.h
parseRefModelConfig
static RefModelConfigConstPtr parseRefModelConfig(const sdf::ElementPtr &sdf)
Parses a basic reference model configuration.
Definition: utils.h:74
ROS_WARN_STREAM
#define ROS_WARN_STREAM(args)
RefModelConfigPtr
std::shared_ptr< RefModelConfig > RefModelConfigPtr
Definition: types.h:42
internal::parseRefModelConfig
static void parseRefModelConfig(const sdf::ElementPtr &sdf, const RefModelConfigPtr &config)
Definition: utils.h:57
ROS_INFO_STREAM
#define ROS_INFO_STREAM(args)
getStringTimestamp
static std::string getStringTimestamp(std::time_t t)
Definition: utils.h:102
RefModelConfigConstPtr
std::shared_ptr< const RefModelConfig > RefModelConfigConstPtr
Definition: types.h:43
ClassName
std::string ClassName
getClassName
static std::string getClassName()
Definition: utils.h:38
createDirectory
static bool createDirectory(const boost::filesystem::path &path)
Definition: utils.h:47
internal
Definition: utils.h:55
ros::NodeHandle


gazebo_video_monitor_plugins
Author(s): Nick Lamprianidis
autogenerated on Tue Oct 24 2023 02:12:50