29 #ifndef SWRI_ROSCPP_PUBLISHER_H_    30 #define SWRI_ROSCPP_PUBLISHER_H_    39   const std::string 
name,
    43   const std::string resolved_name = nh.
resolveName(name);
    46            resolved_name.c_str());
    50 #endif  // SWRI_ROSCPP_PUBLISHER_H_ 
ros::Publisher advertise(ros::NodeHandle &nh, const std::string name, uint32_t queue_size, bool latched=false)
std::string resolveName(const std::string &name, bool remap=true) const 
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)