mia_hand_description  rel 1.0.0
myRemap Class Reference

Class to remap Mia JointState. More...

Collaboration diagram for myRemap:

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...
 

Detailed Description

Class to remap Mia JointState.

Definition at line 19 of file remap_mia_joint_states.cpp.

Constructor & Destructor Documentation

◆ myRemap()

myRemap::myRemap ( )
inline

Constructor.

Definition at line 27 of file remap_mia_joint_states.cpp.

Member Function Documentation

◆ chattercallback()

void myRemap::chattercallback ( const sensor_msgs::JointState::ConstPtr &  msg)
inlineprivate

Callback of the subscriber.

See also
sub()

Definition at line 100 of file remap_mia_joint_states.cpp.

Member Data Documentation

◆ j_index_name

std::string myRemap::j_index_name
private

Name of the index flex joint as declared in the URDF.

Definition at line 78 of file remap_mia_joint_states.cpp.

◆ j_thumb_name

std::string myRemap::j_thumb_name
private

Name of the thumb opp joint as declared in the URDF.

Definition at line 83 of file remap_mia_joint_states.cpp.

◆ MyTh_opp_passiveJoint

mia_hand::thumb_opp_passive_joint myRemap::MyTh_opp_passiveJoint
private

Class describing the thumb_opp and index flex passive joint.

Definition at line 93 of file remap_mia_joint_states.cpp.

◆ n

ros::NodeHandle myRemap::n
private

Ros node varibale.

Definition at line 63 of file remap_mia_joint_states.cpp.

◆ pub

ros::Publisher myRemap::pub
private

Publisher to publish remapped miajoint.

Definition at line 68 of file remap_mia_joint_states.cpp.

◆ remap_th_opp

bool myRemap::remap_th_opp
private

Bool True to remap also the thumb opp position.

Definition at line 58 of file remap_mia_joint_states.cpp.

◆ robot_description_

std::string myRemap::robot_description_
private

Name of parameter link to the URDF.

Definition at line 88 of file remap_mia_joint_states.cpp.

◆ sub

ros::Subscriber myRemap::sub
private

Subscriber to publish listen to raw mia joint states.

Definition at line 73 of file remap_mia_joint_states.cpp.


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