37 #ifndef DRIVER_SVH_SVH_FINGER_MANAGER_H_INCLUDED 38 #define DRIVER_SVH_SVH_FINGER_MANAGER_H_INCLUDED 89 SVHFingerManager(
const std::vector<bool>& disable_mask = std::vector<bool>(9,
false),
90 const uint32_t& reset_timeout = 5);
100 bool connect(
const std::string& dev_name =
"/dev/ttyUSB0",
const unsigned int& retry_count = 3);
125 bool enableChannel(
const SVHChannel& channel);
131 void disableChannel(
const SVHChannel& channel);
137 bool requestControllerFeedbackAllChannels();
144 bool requestControllerFeedback(
const SVHChannel& channel);
152 bool getPosition(
const SVHChannel& channel,
double& position);
160 bool getCurrent(
const SVHChannel& channel,
double& current);
170 bool setAllTargetPositions(
const std::vector<double>& positions);
179 bool setTargetPosition(
const SVHChannel& channel,
double position,
double current);
197 void requestControllerState();
260 bool resetDiagnosticData(
const SVHChannel& channel);
268 std::vector<SVHCurrentSettings> getDefaultCurrentSettings();
273 std::vector<SVHPositionSettings> getDefaultPositionSettings(
const bool& reset =
false);
277 void setDefaultHomeSettings();
283 void setResetSpeed(
const float& speed);
289 void setResetTimeout(
const int& reset_timeout);
296 bool setMaxForce(
float max_force);
304 float setForceLimit(
const SVHChannel& channel,
float force_limit);
312 double convertmAtoN(
const SVHChannel& channel,
const int16_t& current);
322 SVHFirmwareInfo getFirmwareInfo(
const std::string& dev_name =
"/dev/ttyUSB0",
323 const unsigned int& retry_count = 3);
443 int32_t convertRad2Ticks(
const SVHChannel& channel,
const double& position);
451 double convertTicks2Rad(
const SVHChannel& channel,
const int32_t& ticks);
458 uint16_t convertNtomA(
const SVHChannel& channel,
const double& effort);
466 bool isInsideBounds(
const SVHChannel& channel,
const int32_t& target_position);
474 bool currentSettingsAreSafe(
const SVHChannel& channel,
std::vector< SVHChannel > m_reset_order
vector storing the reset order of the channels
float m_reset_speed_factor
Factor for determining the finger speed during reset. Only 0.0-1.0 is allowed.
std::vector< bool > m_is_homed
vector storing reset flags for each channel
std::vector< bool > m_position_settings_given
std::vector< SVHCurrentSettings > m_current_settings
Vector of current controller parameters for each finger (as given by external config) ...
std::chrono::seconds m_homing_timeout
Timeout for homing.
float m_max_current_percentage
limit the maximum of the force / current of the finger as a percentage of the possible maximum ...
std::vector< bool > m_diagnostic_encoder_state
vectors storing diagnostic information, encoder state
double diagnostic_current_maximum
double diagnostic_deadlock
std::vector< int32_t > m_position_max
max position vector for each channel
std::vector< double > m_ticks2rad
position conversion factor (ticks to RAD) for each channel
SVHFirmwareInfo m_firmware_info
Firmware info of the connected Hand.
The SVHCurrentSettings save the current controller paramters for a single motor.
#define DRIVER_SVH_IMPORT_EXPORT
std::vector< double > m_diagnostic_current_maximum
vectors storing diagnostic information, current maximum
bool m_connection_feedback_given
bool isConnected()
returns connected state of finger manager
std::string m_serial_device
m_serial_device Device handle of the device to use, is overwritten if connect is called with an argum...
std::vector< int32_t > m_position_min
min position vector for each channel
std::chrono::seconds m_reset_timeout
Time in seconds after which the a reset is aborted if no change in current is observable.
std::vector< SVHHomeSettings > m_home_settings
Vector of home settings for each finger (as given by external config)
Hints
The Hints enum provides mapping to hints that can be sent to the web-diagnostic interface.
std::vector< SVHPositionSettings > m_position_settings
Vector of position controller parameters for each finger (as given by external config) ...
double diagnostic_current_minimum
std::vector< int32_t > m_position_home
home position after complete reset of each channel
The SVHFirmwareInfo holds the data of a firmware response from the hardware.
The SVHControllerFeedback saves the feedback of a single motor.
std::vector< bool > m_is_switched_off
bool m_connected
holds the connected state
std::atomic< bool > m_poll_feedback
Flag whether to poll feedback periodically in the feedback thread.
std::vector< double > m_diagnostic_deadlock
vectors storing diagnostic information, diagnostics deadlock
std::thread m_feedback_thread
Thread for polling periodic feedback from the hardware.
std::vector< double > m_reset_current_factor
Vector containing factors for the currents at reset. Vector containing factors for the currents at re...
This class controls the the SCHUNK five finger hand.
SVHControllerFeedback m_debug_feedback
bool diagnostic_motor_state
double diagnostic_position_maximum
The SVHPositionSettings save the position controller paramters for a single motor.
std::vector< double > m_diagnostic_current_minimum
vectors storing diagnostic information, current minimum
double diagnostic_position_minimum
std::vector< double > m_diagnostic_position_maximum
vectors storing diagnostic information, position maximum
std::vector< double > m_diagnostic_position_minimum
vectors storing diagnostic information, position minimum
data sctructure for home positions
std::vector< bool > m_current_settings_given
std::vector< bool > m_diagnostic_current_state
vectors storing diagnostic information, current state
SVHController * m_controller
pointer to svh controller
bool diagnostic_encoder_state