26 #ifndef SR_HAND_HAND_VIRTUAL_ARM_H 27 #define SR_HAND_HAND_VIRTUAL_ARM_H 57 virtual int16_t
sendupdate(std::string joint_name,
double target);
75 virtual int16_t
setConfig(std::vector<std::string> myConfig);
77 virtual void getConfig(std::string joint_name);
94 void gazeboCallback(
const sensor_msgs::JointStateConstPtr&
msg);
109 return deg * 3.14159265 / 180.0;
119 return rad * 180.0 / 3.14159265;
125 #endif // SR_HAND_HAND_VIRTUAL_ARM_H
virtual int16_t sendupdate(std::string joint_name, double target)
virtual JointData getJointData(std::string joint_name)
virtual std::vector< DiagnosticData > getDiagnostics()
std::map< std::string, JointData > JointsMap
virtual JointsMap getAllJointsData()
virtual int16_t setConfig(std::vector< std::string > myConfig)
This is a parent class for the different types of Shadowhand we can have. It makes it possible to swa...
virtual int16_t setContrl(std::string contrlr_name, JointControllerData ctrlr_data)
virtual void getConfig(std::string joint_name)
virtual JointControllerData getContrl(std::string ctrlr_name)
This is a parent class for the different types of Shadowhand we can have. It makes it possible to swa...
double toDegrees(double rad)