Public Member Functions | |
void | as_cb (const cob_sound::SayGoalConstPtr &goal) |
void | say (std::string text) |
SayAction (std::string name) | |
bool | service_cb (cob_sound::SayText::Request &req, cob_sound::SayText::Response &res) |
void | topic_cb (const std_msgs::String::ConstPtr &msg) |
~SayAction (void) | |
Protected Attributes | |
std::string | action_name_ |
actionlib::SimpleActionServer < cob_sound::SayAction > | as_ |
ros::NodeHandle | nh_ |
ros::ServiceServer | srvServer_ |
ros::Subscriber | sub |
Definition at line 7 of file sound.cpp.
void SayAction::as_cb | ( | const cob_sound::SayGoalConstPtr & | goal | ) | [inline] |
bool SayAction::service_cb | ( | cob_sound::SayText::Request & | req, | |
cob_sound::SayText::Response & | res | |||
) | [inline] |
void SayAction::topic_cb | ( | const std_msgs::String::ConstPtr & | msg | ) | [inline] |
std::string SayAction::action_name_ [protected] |
actionlib::SimpleActionServer<cob_sound::SayAction> SayAction::as_ [protected] |
ros::NodeHandle SayAction::nh_ [protected] |
ros::ServiceServer SayAction::srvServer_ [protected] |
ros::Subscriber SayAction::sub [protected] |