Commit 727a22c3 authored by oscar's avatar oscar
parents d2a856e5 97fe51a0
......@@ -9,7 +9,9 @@
#include <iostream>
#include <memory>
#include "Component.h"
#ifndef _NO_USING_PARSER_
#include "utils/yaml_parser.h"
#endif
#ifdef _USING_TIMESTAMP_TRACKING_
#include "std_msgs/UInt64MultiArray.h"
#endif
......@@ -25,13 +27,14 @@ int EventsRos::loadConfig(ros::NodeHandle& nh)
std::string config_yaml;
if (run_mode == 1)
{
#ifndef _NO_USING_PARSER_
std::string entry_yaml;
nh.param<std::string>("entry_yaml", entry_yaml, "/home/nvidia/oscar/catkin_ws/src/jfx_yolo5/");
QichechengYamlParser parser;
int ret = parser.parse_yaml(entry_yaml, m_root_dir);
if (ret != 0)return -1;
m_config = parser.entry["EVENT_YAML_NODE"];
#endif
}
else
{
......
Markdown is supported
0% or
You are about to add 0 people to the discussion. Proceed with caution.
Finish editing this message first!
Please register or to comment