#include <xbot_talker_ros.h>
Public Member Functions | |
AwakenModuleRos () | |
bool | init () |
void | isWaken () |
~AwakenModuleRos () | |
Private Member Functions | |
void | advertiseTopics () |
void | pubStartRecog (bool is_awaken) |
void | subscribeStartAwaken (const std_msgs::BoolConstPtr) |
void | subscribeTopics () |
Private Attributes | |
int | audio_channel |
std::string | audio_save_path |
std::string | awaken_mode |
AwakenOffline | awaken_module |
ros::NodeHandle | awaken_nodehandle |
std::string | awaken_params_ |
std::string | base_path |
std::string | config_path |
bool | enable_record_save |
ros::Publisher | is_awaken_pub |
std::string | log_path |
std::string | pcm_file |
int | record_time |
ros::Subscriber | start_awaken_sub |
Definition at line 179 of file xbot_talker_ros.h.
AwakenModuleRos::AwakenModuleRos | ( | ) |
Definition at line 835 of file xbot_talker_ros.cpp.
AwakenModuleRos::~AwakenModuleRos | ( | ) |
Definition at line 838 of file xbot_talker_ros.cpp.
|
private |
Definition at line 865 of file xbot_talker_ros.cpp.
bool AwakenModuleRos::init | ( | ) |
Definition at line 842 of file xbot_talker_ros.cpp.
void AwakenModuleRos::isWaken | ( | ) |
Definition at line 883 of file xbot_talker_ros.cpp.
|
private |
Definition at line 876 of file xbot_talker_ros.cpp.
|
private |
Definition at line 912 of file xbot_talker_ros.cpp.
|
private |
Definition at line 870 of file xbot_talker_ros.cpp.
|
private |
Definition at line 203 of file xbot_talker_ros.h.
|
private |
Definition at line 201 of file xbot_talker_ros.h.
|
private |
Definition at line 200 of file xbot_talker_ros.h.
|
private |
Definition at line 188 of file xbot_talker_ros.h.
|
private |
Definition at line 189 of file xbot_talker_ros.h.
|
private |
Definition at line 196 of file xbot_talker_ros.h.
|
private |
Definition at line 197 of file xbot_talker_ros.h.
|
private |
Definition at line 198 of file xbot_talker_ros.h.
|
private |
Definition at line 195 of file xbot_talker_ros.h.
|
private |
Definition at line 206 of file xbot_talker_ros.h.
|
private |
Definition at line 202 of file xbot_talker_ros.h.
|
private |
Definition at line 199 of file xbot_talker_ros.h.
|
private |
Definition at line 204 of file xbot_talker_ros.h.
|
private |
Definition at line 207 of file xbot_talker_ros.h.