Public Member Functions | |
| cob_teleop_cob4_impl () | |
| void | configure (cob_teleop_cob4_config config) |
| void | initRecover (const std::string component) |
| sensor_msgs::JoyFeedbackArray | ledsOn (XmlRpc::XmlRpcValue leds) |
| void | serviceCall (const std::string component, const std::string command) |
| void | update (cob_teleop_cob4_data &data, cob_teleop_cob4_config config) |
Private Types | |
| typedef actionlib::SimpleActionClient < cob_script_server::ScriptAction > | Client |
Private Attributes | |
| geometry_msgs::Twist | arm_cart |
| geometry_msgs::Twist | base |
| Client * | client |
| brics_actuator::JointVelocities | gleft |
| brics_actuator::JointVelocities | gright |
| geometry_msgs::Twist | head |
| sensor_msgs::Joy | joy |
| sensor_msgs::JoyFeedbackArray | joyfb |
| XmlRpc::XmlRpcValue | LEDS |
| brics_actuator::JointVelocities | left |
| float | leftright |
| int | mode |
| bool | once |
| bool | once_mode |
| bool | once_stop |
| brics_actuator::JointVelocities | right |
| float | run |
| brics_actuator::JointVelocities | sring |
| cob_script_server::ScriptGoal | sss |
| geometry_msgs::Twist | torso |
| cob_srvs::Trigger | trigger |
| float | updown |
Definition at line 123 of file cob_teleop_cob4_common.cpp.
typedef actionlib::SimpleActionClient<cob_script_server::ScriptAction> cob_teleop_cob4_impl::Client [private] |
Definition at line 126 of file cob_teleop_cob4_common.cpp.
| cob_teleop_cob4_impl::cob_teleop_cob4_impl | ( | ) | [inline] |
Definition at line 158 of file cob_teleop_cob4_common.cpp.
| void cob_teleop_cob4_impl::configure | ( | cob_teleop_cob4_config | config | ) | [inline] |
Definition at line 168 of file cob_teleop_cob4_common.cpp.
| void cob_teleop_cob4_impl::initRecover | ( | const std::string | component | ) | [inline] |
Definition at line 429 of file cob_teleop_cob4_common.cpp.
| sensor_msgs::JoyFeedbackArray cob_teleop_cob4_impl::ledsOn | ( | XmlRpc::XmlRpcValue | leds | ) | [inline] |
Definition at line 440 of file cob_teleop_cob4_common.cpp.
| void cob_teleop_cob4_impl::serviceCall | ( | const std::string | component, |
| const std::string | command | ||
| ) | [inline] |
Definition at line 422 of file cob_teleop_cob4_common.cpp.
| void cob_teleop_cob4_impl::update | ( | cob_teleop_cob4_data & | data, |
| cob_teleop_cob4_config | config | ||
| ) | [inline] |
Definition at line 202 of file cob_teleop_cob4_common.cpp.
geometry_msgs::Twist cob_teleop_cob4_impl::arm_cart [private] |
Definition at line 140 of file cob_teleop_cob4_common.cpp.
geometry_msgs::Twist cob_teleop_cob4_impl::base [private] |
Definition at line 138 of file cob_teleop_cob4_common.cpp.
Client* cob_teleop_cob4_impl::client [private] |
Definition at line 127 of file cob_teleop_cob4_common.cpp.
brics_actuator::JointVelocities cob_teleop_cob4_impl::gleft [private] |
Definition at line 145 of file cob_teleop_cob4_common.cpp.
brics_actuator::JointVelocities cob_teleop_cob4_impl::gright [private] |
Definition at line 146 of file cob_teleop_cob4_common.cpp.
geometry_msgs::Twist cob_teleop_cob4_impl::head [private] |
Definition at line 137 of file cob_teleop_cob4_common.cpp.
sensor_msgs::Joy cob_teleop_cob4_impl::joy [private] |
Definition at line 141 of file cob_teleop_cob4_common.cpp.
sensor_msgs::JoyFeedbackArray cob_teleop_cob4_impl::joyfb [private] |
Definition at line 149 of file cob_teleop_cob4_common.cpp.
Definition at line 152 of file cob_teleop_cob4_common.cpp.
brics_actuator::JointVelocities cob_teleop_cob4_impl::left [private] |
Definition at line 142 of file cob_teleop_cob4_common.cpp.
float cob_teleop_cob4_impl::leftright [private] |
Definition at line 136 of file cob_teleop_cob4_common.cpp.
int cob_teleop_cob4_impl::mode [private] |
Definition at line 133 of file cob_teleop_cob4_common.cpp.
bool cob_teleop_cob4_impl::once [private] |
Definition at line 129 of file cob_teleop_cob4_common.cpp.
bool cob_teleop_cob4_impl::once_mode [private] |
Definition at line 131 of file cob_teleop_cob4_common.cpp.
bool cob_teleop_cob4_impl::once_stop [private] |
Definition at line 130 of file cob_teleop_cob4_common.cpp.
brics_actuator::JointVelocities cob_teleop_cob4_impl::right [private] |
Definition at line 143 of file cob_teleop_cob4_common.cpp.
float cob_teleop_cob4_impl::run [private] |
Definition at line 134 of file cob_teleop_cob4_common.cpp.
brics_actuator::JointVelocities cob_teleop_cob4_impl::sring [private] |
Definition at line 144 of file cob_teleop_cob4_common.cpp.
cob_script_server::ScriptGoal cob_teleop_cob4_impl::sss [private] |
Definition at line 147 of file cob_teleop_cob4_common.cpp.
geometry_msgs::Twist cob_teleop_cob4_impl::torso [private] |
Definition at line 139 of file cob_teleop_cob4_common.cpp.
cob_srvs::Trigger cob_teleop_cob4_impl::trigger [private] |
Definition at line 154 of file cob_teleop_cob4_common.cpp.
float cob_teleop_cob4_impl::updown [private] |
Definition at line 135 of file cob_teleop_cob4_common.cpp.