Implementation of teleoperation node. More...
Implementation of teleoperation node.
Sends direct commands to different components
Definition at line 85 of file cob_teleop.cpp.
Constructor for TeleopCOB class.
Definition at line 332 of file cob_teleop.cpp.
Destructor for TeleopCOB class.
Definition at line 356 of file cob_teleop.cpp.
| bool TeleopCOB::assign_base_module | ( | XmlRpc::XmlRpcValue | mod_struct | ) |  [private] | 
        
Tries to read base module configurations from XmlRpcValue object. A base module is supposed to contain vectors 3 element vectors (x,y,th) with max acceleration and velocity. Example: struct { max_velocity: [0.3, 0.2, 0.3], max_acceleration: [0.5, 0.5, 0.7] }
| mod_struct | configuration object struct | 
Definition at line 273 of file cob_teleop.cpp.
| bool TeleopCOB::assign_joint_module | ( | std::string | mod_name, | 
| XmlRpc::XmlRpcValue | mod_struct | ||
| ) |  [private] | 
        
Tries to read joint module configurations from XmlRpcValue object. If the module is a joint module, it contains a joint name array. A typical joint module has the following configuration structure: struct { joint_names: ['head_pan_joint','head_tilt_joint'], joint_step: 0.075 }
| mod_struct | configuration object struct | 
Definition at line 203 of file cob_teleop.cpp.
Definition at line 158 of file cob_teleop.cpp.
| void TeleopCOB::init | ( | ) | 
Initializes node to get parameters, subscribe to topics.
Definition at line 363 of file cob_teleop.cpp.
| void TeleopCOB::joint_states_cb | ( | const sensor_msgs::JointState::ConstPtr & | joint_states_msg | ) | 
Executes the callback from the joint_states topic. (published by joint state driver)
Only used to get the initaial joint positions.
| msg | JointState | 
Definition at line 446 of file cob_teleop.cpp.
| void TeleopCOB::joy_cb | ( | const sensor_msgs::Joy::ConstPtr & | joy_msg | ) | 
Executes the callback from the joystick topic.
Gets the configuration
| joy_msg | Joy | 
Definition at line 478 of file cob_teleop.cpp.
| void TeleopCOB::setInitValues | ( | ) | 
Sets initial values for target velocities.
Definition at line 416 of file cob_teleop.cpp.
| void TeleopCOB::update | ( | void | ) | 
Main routine for updating all components.
Definition at line 813 of file cob_teleop.cpp.
| void TeleopCOB::update_base | ( | ) | 
Routine for updating the base commands.
Definition at line 906 of file cob_teleop.cpp.
| void TeleopCOB::update_joint_modules | ( | ) | 
Definition at line 865 of file cob_teleop.cpp.
Definition at line 114 of file cob_teleop.cpp.
Definition at line 115 of file cob_teleop.cpp.
Definition at line 116 of file cob_teleop.cpp.
Definition at line 117 of file cob_teleop.cpp.
Definition at line 113 of file cob_teleop.cpp.
Definition at line 113 of file cob_teleop.cpp.
Definition at line 113 of file cob_teleop.cpp.
Definition at line 123 of file cob_teleop.cpp.
Definition at line 122 of file cob_teleop.cpp.
Definition at line 122 of file cob_teleop.cpp.
Definition at line 131 of file cob_teleop.cpp.
Definition at line 109 of file cob_teleop.cpp.
Definition at line 140 of file cob_teleop.cpp.
| std::map<std::string,joint_module> TeleopCOB::joint_modules_ | 
Definition at line 98 of file cob_teleop.cpp.
| std::vector<std::string> TeleopCOB::joint_names_ | 
Definition at line 139 of file cob_teleop.cpp.
Definition at line 129 of file cob_teleop.cpp.
Definition at line 123 of file cob_teleop.cpp.
Definition at line 128 of file cob_teleop.cpp.
Definition at line 119 of file cob_teleop.cpp.
Definition at line 111 of file cob_teleop.cpp.
Definition at line 127 of file cob_teleop.cpp.
Definition at line 122 of file cob_teleop.cpp.
Definition at line 122 of file cob_teleop.cpp.
| double TeleopCOB::run_factor_ | 
Definition at line 124 of file cob_teleop.cpp.
| double TeleopCOB::run_factor_param_ | 
Definition at line 124 of file cob_teleop.cpp.
Definition at line 122 of file cob_teleop.cpp.
Definition at line 123 of file cob_teleop.cpp.
| double TeleopCOB::time_for_init_ | 
Definition at line 132 of file cob_teleop.cpp.
Definition at line 112 of file cob_teleop.cpp.
Definition at line 119 of file cob_teleop.cpp.
Definition at line 111 of file cob_teleop.cpp.