Public Member Functions | |
void | as_cb (const cob_sound::SayGoalConstPtr &goal) |
bool | say (std::string text) |
SayAction (std::string name) | |
bool | service_cb (cob_sound::SayText::Request &req, cob_sound::SayText::Response &res) |
bool | service_cb_mute (cob_srvs::Trigger::Request &req, cob_srvs::Trigger::Response &res) |
bool | service_cb_unmute (cob_srvs::Trigger::Request &req, cob_srvs::Trigger::Response &res) |
void | topic_cb (const std_msgs::String::ConstPtr &msg) |
~SayAction (void) | |
Public Attributes | |
diagnostic_msgs::DiagnosticArray | diagnostics_ |
ros::Publisher | topicPub_Diagnostic_ |
Protected Attributes | |
std::string | action_name_ |
actionlib::SimpleActionServer < cob_sound::SayAction > | as_ |
bool | mute_ |
ros::NodeHandle | nh_ |
ros::ServiceServer | srvServer_ |
ros::ServiceServer | srvServer_mute_ |
ros::ServiceServer | srvServer_unmute_ |
ros::Subscriber | sub_ |
SayAction::SayAction | ( | std::string | name | ) | [inline] |
SayAction::~SayAction | ( | void | ) | [inline] |
void SayAction::as_cb | ( | const cob_sound::SayGoalConstPtr & | goal | ) | [inline] |
bool SayAction::say | ( | std::string | text | ) | [inline] |
bool SayAction::service_cb | ( | cob_sound::SayText::Request & | req, |
cob_sound::SayText::Response & | res | ||
) | [inline] |
bool SayAction::service_cb_mute | ( | cob_srvs::Trigger::Request & | req, |
cob_srvs::Trigger::Response & | res | ||
) | [inline] |
bool SayAction::service_cb_unmute | ( | cob_srvs::Trigger::Request & | req, |
cob_srvs::Trigger::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] |
diagnostic_msgs::DiagnosticArray SayAction::diagnostics_ |
bool SayAction::mute_ [protected] |
ros::NodeHandle SayAction::nh_ [protected] |
ros::ServiceServer SayAction::srvServer_ [protected] |
ros::ServiceServer SayAction::srvServer_mute_ [protected] |
ros::ServiceServer SayAction::srvServer_unmute_ [protected] |
ros::Subscriber SayAction::sub_ [protected] |