force_torque_sensor_sim.h
Go to the documentation of this file.
1 
2 #ifndef FORCETORQUESENSORSIM_INCLUDEDEF_H
3 #define FORCETORQUESENSORSIM_INCLUDEDEF_H
4 
5 #include <ros/ros.h>
6 #include <geometry_msgs/Twist.h>
7 #include <geometry_msgs/WrenchStamped.h>
8 
10 
11 namespace force_torque_sensor
12 {
13 
15 {
16 public:
18  ForceTorqueSensorSim(int type, std::string path, int baudrate, int base_identifier);
20 
21  bool init();
22  bool initCommunication(int type, std::string path, int baudrate, int base_identifier);
23  bool readFTData(int statusCode, double& Fx, double& Fy, double& Fz, double& Tx, double& Ty, double& Tz);
24  bool readDiagnosticADCVoltages(int index, short int& value);
25 
26  void subscribeData(const geometry_msgs::Twist::ConstPtr& msg);
27  geometry_msgs::WrenchStamped joystick_data;
28 
29 private:
32 };
33 
34 }
35 #endif
36 
bool readDiagnosticADCVoltages(int index, short int &value)
bool readFTData(int statusCode, double &Fx, double &Fy, double &Fz, double &Tx, double &Ty, double &Tz)
bool initCommunication(int type, std::string path, int baudrate, int base_identifier)
void subscribeData(const geometry_msgs::Twist::ConstPtr &msg)


force_torque_sensor
Author(s):
autogenerated on Fri Sep 18 2020 03:06:30