13 #ifndef YUJIN_OCS_CMD_VEL_SUBSCRIBERS_HPP_    14 #define YUJIN_OCS_CMD_VEL_SUBSCRIBERS_HPP_    21 #include <geometry_msgs/Twist.h>    23 #include <yaml-cpp/yaml.h>    25 #ifdef HAVE_NEW_YAMLCPP    29 void operator >> (
const YAML::Node& node, T& i)
    70     CmdVelSubs(
unsigned int idx) : idx(idx), active(false) { };
    80   std::vector<std::shared_ptr<CmdVelSubs>>::size_type 
size() { 
return list.size(); };
    96   std::vector<std::shared_ptr<CmdVelSubs>> 
list;
 
void configure(const YAML::Node &node)
Configures the subscribers from a yaml file. 
std::vector< std::shared_ptr< CmdVelSubs > > list
CmdVelSubs(unsigned int idx)
std::vector< std::shared_ptr< CmdVelSubs > >::size_type size()
void operator<<(const YAML::Node &node)
std::shared_ptr< CmdVelSubs > & operator[](unsigned int idx)