Classes | Public Types | Public Member Functions | Public Attributes | List of all members
CobTeleop Class Reference

Classes

struct  component_config
 

Public Types

typedef actionlib::SimpleActionClient< cob_actions::SetStringAction > DockClient_
 
typedef actionlib::SimpleActionClient< cob_sound::SayAction > SayClient_
 
typedef actionlib::SimpleActionClient< cob_script_server::ScriptAction > ScriptClient_
 
typedef actionlib::SimpleActionClient< cob_light::SetLightModeAction > SetLightClient_
 
typedef actionlib::SimpleActionClient< cob_actions::SetStringAction > UndockClient_
 

Public Member Functions

void getConfigurationFromParameters ()
 
void init ()
 Initializes node to get parameters, subscribe to topics. More...
 
void joy_cb (const sensor_msgs::Joy::ConstPtr &joy_msg)
 
void say (std::string text, bool blocking)
 
void setLight (int mode)
 
sensor_msgs::JoyFeedbackArray switch_mode ()
 
void updateBase ()
 

Public Attributes

bool apply_ramp_
 
int axis_pitch_
 
int axis_roll_
 
int axis_vx_
 
int axis_vy_
 
int axis_vz_
 
int axis_yaw_
 
std::map< std::string, component_configcomponent_config_
 
XmlRpc::XmlRpcValue components_
 
cob_light::SetLightModeGoal confirm_light_goal_
 
int deadman_button_
 
std::string dock_action_name_
 
int dock_button_
 
DockClient_dock_client_
 
bool enable_light_
 
bool enable_sound_
 
cob_light::SetLightModeGoal error_light_goal_
 
int init_button_
 
ros::Subscriber joint_states_sub_
 
bool joy_active_
 
int joy_num_modes_
 
ros::Subscriber joy_sub_
 
XmlRpc::XmlRpcValue led_mode_
 
XmlRpc::XmlRpcValue LEDS_
 
int left_indicator_button_
 
std::string light_action_name_
 
int mode_
 
int mode_switch_button_
 
ros::NodeHandle n_
 
double publish_freq_
 
int right_indicator_button_
 
int right_left_button_
 
int run_button_
 
double run_factor_
 
double run_factor_param_
 
bool safe_mode_
 
int safety_button_
 
SayClient_say_client_
 
cob_script_server::ScriptGoal script_goal_
 
SetLightClient_setlight_client_
 
std::string sound_action_name_
 
ScriptClient_sss_client_
 
std::string undock_action_name_
 
int undock_button_
 
UndockClient_undock_client_
 
int up_down_button_
 
std::vector< double > vel_base_
 
std::vector< double > vel_old_
 
std::vector< double > vel_req_
 

Detailed Description

Definition at line 35 of file cob_teleop.cpp.

Member Typedef Documentation

typedef actionlib::SimpleActionClient<cob_actions::SetStringAction> CobTeleop::DockClient_

Definition at line 105 of file cob_teleop.cpp.

Definition at line 95 of file cob_teleop.cpp.

typedef actionlib::SimpleActionClient<cob_script_server::ScriptAction> CobTeleop::ScriptClient_

Definition at line 91 of file cob_teleop.cpp.

typedef actionlib::SimpleActionClient<cob_light::SetLightModeAction> CobTeleop::SetLightClient_

Definition at line 100 of file cob_teleop.cpp.

typedef actionlib::SimpleActionClient<cob_actions::SetStringAction> CobTeleop::UndockClient_

Definition at line 109 of file cob_teleop.cpp.

Member Function Documentation

void CobTeleop::getConfigurationFromParameters ( )

Definition at line 130 of file cob_teleop.cpp.

void CobTeleop::init ( )

Initializes node to get parameters, subscribe to topics.

Definition at line 716 of file cob_teleop.cpp.

void CobTeleop::joy_cb ( const sensor_msgs::Joy::ConstPtr &  joy_msg)

Definition at line 406 of file cob_teleop.cpp.

void CobTeleop::say ( std::string  text,
bool  blocking 
)

Definition at line 371 of file cob_teleop.cpp.

void CobTeleop::setLight ( int  mode)

Definition at line 385 of file cob_teleop.cpp.

sensor_msgs::JoyFeedbackArray CobTeleop::switch_mode ( )

Definition at line 266 of file cob_teleop.cpp.

void CobTeleop::updateBase ( )

Definition at line 313 of file cob_teleop.cpp.

Member Data Documentation

bool CobTeleop::apply_ramp_

Definition at line 119 of file cob_teleop.cpp.

int CobTeleop::axis_pitch_

Definition at line 57 of file cob_teleop.cpp.

int CobTeleop::axis_roll_

Definition at line 57 of file cob_teleop.cpp.

int CobTeleop::axis_vx_

Definition at line 57 of file cob_teleop.cpp.

int CobTeleop::axis_vy_

Definition at line 57 of file cob_teleop.cpp.

int CobTeleop::axis_vz_

Definition at line 57 of file cob_teleop.cpp.

int CobTeleop::axis_yaw_

Definition at line 57 of file cob_teleop.cpp.

std::map<std::string,component_config> CobTeleop::component_config_

Definition at line 54 of file cob_teleop.cpp.

XmlRpc::XmlRpcValue CobTeleop::components_

Definition at line 86 of file cob_teleop.cpp.

cob_light::SetLightModeGoal CobTeleop::confirm_light_goal_

Definition at line 113 of file cob_teleop.cpp.

int CobTeleop::deadman_button_

Definition at line 73 of file cob_teleop.cpp.

std::string CobTeleop::dock_action_name_

Definition at line 107 of file cob_teleop.cpp.

int CobTeleop::dock_button_

Definition at line 62 of file cob_teleop.cpp.

DockClient_* CobTeleop::dock_client_

Definition at line 106 of file cob_teleop.cpp.

bool CobTeleop::enable_light_

Definition at line 102 of file cob_teleop.cpp.

bool CobTeleop::enable_sound_

Definition at line 97 of file cob_teleop.cpp.

cob_light::SetLightModeGoal CobTeleop::error_light_goal_

Definition at line 114 of file cob_teleop.cpp.

int CobTeleop::init_button_

Definition at line 75 of file cob_teleop.cpp.

ros::Subscriber CobTeleop::joint_states_sub_

Definition at line 89 of file cob_teleop.cpp.

bool CobTeleop::joy_active_

Definition at line 76 of file cob_teleop.cpp.

int CobTeleop::joy_num_modes_

Definition at line 80 of file cob_teleop.cpp.

ros::Subscriber CobTeleop::joy_sub_

Definition at line 88 of file cob_teleop.cpp.

XmlRpc::XmlRpcValue CobTeleop::led_mode_

Definition at line 84 of file cob_teleop.cpp.

XmlRpc::XmlRpcValue CobTeleop::LEDS_

Definition at line 83 of file cob_teleop.cpp.

int CobTeleop::left_indicator_button_

Definition at line 67 of file cob_teleop.cpp.

std::string CobTeleop::light_action_name_

Definition at line 103 of file cob_teleop.cpp.

int CobTeleop::mode_

Definition at line 82 of file cob_teleop.cpp.

int CobTeleop::mode_switch_button_

Definition at line 81 of file cob_teleop.cpp.

ros::NodeHandle CobTeleop::n_

Definition at line 87 of file cob_teleop.cpp.

double CobTeleop::publish_freq_

Definition at line 78 of file cob_teleop.cpp.

int CobTeleop::right_indicator_button_

Definition at line 66 of file cob_teleop.cpp.

int CobTeleop::right_left_button_

Definition at line 69 of file cob_teleop.cpp.

int CobTeleop::run_button_

Definition at line 61 of file cob_teleop.cpp.

double CobTeleop::run_factor_

Definition at line 79 of file cob_teleop.cpp.

double CobTeleop::run_factor_param_

Definition at line 79 of file cob_teleop.cpp.

bool CobTeleop::safe_mode_

Definition at line 77 of file cob_teleop.cpp.

int CobTeleop::safety_button_

Definition at line 74 of file cob_teleop.cpp.

SayClient_* CobTeleop::say_client_

Definition at line 96 of file cob_teleop.cpp.

cob_script_server::ScriptGoal CobTeleop::script_goal_

Definition at line 93 of file cob_teleop.cpp.

SetLightClient_* CobTeleop::setlight_client_

Definition at line 101 of file cob_teleop.cpp.

std::string CobTeleop::sound_action_name_

Definition at line 98 of file cob_teleop.cpp.

ScriptClient_* CobTeleop::sss_client_

Definition at line 92 of file cob_teleop.cpp.

std::string CobTeleop::undock_action_name_

Definition at line 111 of file cob_teleop.cpp.

int CobTeleop::undock_button_

Definition at line 63 of file cob_teleop.cpp.

UndockClient_* CobTeleop::undock_client_

Definition at line 110 of file cob_teleop.cpp.

int CobTeleop::up_down_button_

Definition at line 68 of file cob_teleop.cpp.

std::vector<double> CobTeleop::vel_base_

Definition at line 118 of file cob_teleop.cpp.

std::vector<double> CobTeleop::vel_old_

Definition at line 116 of file cob_teleop.cpp.

std::vector<double> CobTeleop::vel_req_

Definition at line 117 of file cob_teleop.cpp.


The documentation for this class was generated from the following file:


cob_teleop
Author(s): Florian Weisshardt, Maximilian Sieber
autogenerated on Wed Apr 7 2021 03:03:13