mia_hand_description
rel 1.0.0
|
Class to remap Mia JointState. More...
Public Member Functions | |
myRemap () | |
Constructor. More... | |
Private Member Functions | |
void | chattercallback (const sensor_msgs::JointState::ConstPtr &msg) |
Callback of the subscriber. More... | |
Private Attributes | |
bool | remap_th_opp |
Bool True to remap also the thumb opp position. More... | |
ros::NodeHandle | n |
Ros node varibale. More... | |
ros::Publisher | pub |
Publisher to publish remapped miajoint. More... | |
ros::Subscriber | sub |
Subscriber to publish listen to raw mia joint states. More... | |
std::string | j_index_name |
Name of the index flex joint as declared in the URDF. More... | |
std::string | j_thumb_name |
Name of the thumb opp joint as declared in the URDF. More... | |
std::string | robot_description_ |
Name of parameter link to the URDF. More... | |
mia_hand::thumb_opp_passive_joint | MyTh_opp_passiveJoint |
Class describing the thumb_opp and index flex passive joint. More... | |
Class to remap Mia JointState.
Definition at line 19 of file remap_mia_joint_states.cpp.
|
inline |
Constructor.
Definition at line 27 of file remap_mia_joint_states.cpp.
|
inlineprivate |
Callback of the subscriber.
Definition at line 100 of file remap_mia_joint_states.cpp.
|
private |
Name of the index flex joint as declared in the URDF.
Definition at line 78 of file remap_mia_joint_states.cpp.
|
private |
Name of the thumb opp joint as declared in the URDF.
Definition at line 83 of file remap_mia_joint_states.cpp.
|
private |
Class describing the thumb_opp and index flex passive joint.
Definition at line 93 of file remap_mia_joint_states.cpp.
|
private |
Ros node varibale.
Definition at line 63 of file remap_mia_joint_states.cpp.
|
private |
Publisher to publish remapped miajoint.
Definition at line 68 of file remap_mia_joint_states.cpp.
|
private |
Bool True to remap also the thumb opp position.
Definition at line 58 of file remap_mia_joint_states.cpp.
|
private |
Name of parameter link to the URDF.
Definition at line 88 of file remap_mia_joint_states.cpp.
|
private |
Subscriber to publish listen to raw mia joint states.
Definition at line 73 of file remap_mia_joint_states.cpp.