30 speech_topic_(speech_topic),
32 p_tts_( session->service(
"ALTextToSpeech") )
44 p_tts_.async<
void>(
"say", string_msg->data);
void reset(ros::NodeHandle &nh)
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
SpeechSubscriber(const std::string &name, const std::string &speech_topic, const qi::SessionPtr &session)
ros::Subscriber sub_speech_
std::string speech_topic_
void speech_callback(const std_msgs::StringConstPtr &speech_msg)