53 const uint32_t& reset_timeout)
57 , m_connection_feedback_given(false)
58 , m_homing_timeout(10)
72 , m_reset_speed_factor(0.2)
73 , m_reset_timeout(reset_timeout)
79 , m_serial_device(
"/dev/ttyUSB0")
104 <<
" was disabled as per user request. It will not do anything!");
137 "Finger manager is trying to connect to the Hardware...");
152 unsigned int num_retries = retry_count;
180 auto start_time = std::chrono::high_resolution_clock::now();
181 bool timeout =
false;
182 unsigned int received_count = 0;
183 unsigned int send_count = 0;
188 if (send_count == received_count)
192 "Successfully established connection to SCHUNK five finger hand." 193 <<
"Send packages = " << send_count
194 <<
", received packages = " << received_count);
197 "Try to connect to SCHUNK five finger hand: Send packages = " 198 << send_count <<
", received packages = " << received_count);
201 if ((std::chrono::high_resolution_clock::now() - start_time) >
m_reset_timeout)
205 "Connection timeout! Could not connect to SCHUNK five finger hand." 206 <<
"Send packages = " << send_count
207 <<
", received packages = " << received_count);
209 std::this_thread::sleep_for(std::chrono::microseconds(50000));
215 if (received_count > 0 && num_retries >= 0)
219 "Connection Failed! Send packages = " 220 << send_count <<
", received packages = " << received_count
221 <<
". Retrying, count: " << num_retries);
227 "Connection Failed! Send packages = " 228 << send_count <<
", received packages = " << received_count
229 <<
". Not Retrying anymore.");
239 "A Stable connection could NOT be made, however some packages where " 240 "received. Please check the hardware!");
258 "Finger manager is starting the fedback polling thread");
278 "Finger manager is trying to discoconnect to the Hardware...");
305 bool reset_all_success =
true;
309 size_t max_reset_counter = 3;
310 bool reset_success =
false;
311 while (!reset_success && max_reset_counter > 0)
319 "resetChannel",
"Channel " <<
m_reset_order[i] <<
" reset success = " << reset_success);
322 reset_all_success = reset_all_success && reset_success;
325 return reset_all_success;
337 "Setting reset position values for controller of channel " << channel);
353 int32_t position = 0;
357 position =
static_cast<int32_t
>(pos_set.
wmx);
361 position =
static_cast<int32_t
>(pos_set.
wmn);
366 << channel <<
" to hardstop. Detection thresholds: Current MIN: " 377 auto start_time = std::chrono::high_resolution_clock::now();
378 auto start_time_log = std::chrono::high_resolution_clock::now();
380 bool stale_notification_sent =
false;
382 for (
size_t hit_count = 0; hit_count < 10;)
390 if (std::chrono::duration_cast<std::chrono::milliseconds>(
391 std::chrono::high_resolution_clock::now() - start_time_log) >
392 std::chrono::milliseconds(1000))
397 <<
" current: " << control_feedback.
current <<
" mA");
398 start_time_log = std::chrono::high_resolution_clock::now();
401 double threshold = 80;
408 if (delta <= -threshold)
419 if (delta >= threshold)
451 <<
" Hit Count increased: " << hit_count);
453 else if (hit_count > 0)
459 <<
" Hit Count Decreased: " << hit_count);
463 if ((std::chrono::high_resolution_clock::now() - start_time) >
m_homing_timeout)
467 "Timeout: Aborted finding home position for channel " << channel);
482 start_time = std::chrono::high_resolution_clock::now();
483 if (stale_notification_sent)
489 <<
" Stale resolved, continuing detection");
490 stale_notification_sent =
false;
495 if (!stale_notification_sent)
501 <<
" Stale detected. Starting Timeout");
502 stale_notification_sent =
true;
507 control_feedback_previous = control_feedback;
514 <<
" current: " << control_feedback.
current <<
" mA");
527 "Setting soft stops for Channel " 537 start_time = std::chrono::high_resolution_clock::now();
547 <<
" current: " << control_feedback.
current 548 <<
" mA, position ticks: " << control_feedback.
position);
550 if (abs(position - control_feedback.
position) < 1000)
558 if ((std::chrono::high_resolution_clock::now() - start_time) >
m_homing_timeout)
562 "Channel " << channel <<
" home position is not reachable after " 564 <<
"s! There could be an hardware error!");
572 "Restoring default position values for controller of channel " 579 "Channel " << channel
580 <<
"switched of by user, homing is set to finished");
604 "Could not reset channel " 605 << channel <<
": No connection to SCHUNK five finger hand!");
627 "Could not get diagnostic status for unknown/unsupported channel " 688 bool all_disabled =
true;
708 "Feedback for channel " 709 << channel <<
" could not be requested. FM is not connected to HW.");
760 current = controller_feedback.
current;
781 bool reject_command =
false;
798 reject_command =
true;
812 "Could not set target position vector: At least one channel is out of bounds!");
819 "Size of target position vector wrong: size = " 820 << positions.size() <<
" expected size = " << (int)
SVH_DIMENSION);
830 "Could not set target position vector: No connection to SCHUNK five finger hand!");
848 "Target position for channel " 849 << channel <<
" was ignored as it is switched off by the user");
876 "Target position for channel " << channel <<
" out of bounds!");
883 "Could not set target position for channel " << channel
884 <<
": Reset first!");
891 "Could not set target position for channel " << channel
892 <<
": Illegal Channel");
903 "Could not set target position for channel " 904 << channel <<
": No connection to SCHUNK five finger hand!");
916 bool all_enabled =
true;
919 all_enabled = all_enabled &&
isEnabled(static_cast<SVHChannel>(i));
948 "isEnabled was requested for UNKNOWN Channel: " << channel);
957 bool all_homed =
true;
960 all_homed = all_homed &&
isHomed(static_cast<SVHChannel>(i));
961 if (!
isHomed(static_cast<SVHChannel>(i)))
964 "All finger homed check failed: Channel: " 981 "isHomed was requested for UNKNOWN Channel: " << channel);
996 "Could not get current settings for unknown/unsupported channel " 1012 "Could not get position settings for unknown/unsupported channel " 1028 "Could not get home settings for unknown/unsupported channel " << channel);
1036 bool settings_are_safe =
false;
1045 if (current_settings.
wmx <=
1050 settings_are_safe =
true;
1055 "Current value given: " << current_settings.
wmx <<
" is not valid.");
1058 " Please provide values between " 1070 return settings_are_safe;
1085 "WARNING!!! Current Controller Params for channel " 1086 << channel <<
" would be dangerous! Currents are limited!!!");
1104 "Could not set Current Controller Params for channel " 1105 << channel <<
": No such channel");
1131 "Could not set Position Controller Params for channel " 1132 << channel <<
": No such channel");
1146 "Channel " << channel <<
" setting new homing settings : ");
1148 "Direction " << home_settings.
direction <<
" " 1152 <<
"Range Rad " << home_settings.
range_rad <<
" " 1167 "Could not set homing settings for channel " << channel
1168 <<
": No such channel");
1189 "Diagnostic data for all channel reseted successfully");
1203 "Diagnostic data for channel " << channel <<
" reseted successfully");
1209 "Could not reset diagnostic data for channel " << channel
1210 <<
": No such channel");
1259 std::vector<SVHCurrentSettings> current_settings(
SVH_DIMENSION);
1266 -500.0f, 500.0f, 0.405f, 4e-6f, -25.0f, 25.0f, 0.6f, 10.0f, -255.0f, 255.0f);
1268 -500.0f, 500.0f, 0.405f, 4e-6f, -25.0f, 25.0f, 1.0f, 10.0f, -255.0f, 255.0f);
1270 -300.0f, 300.0f, 0.405f, 4e-6f, -25.0f, 25.0f, 1.0f, 10.0f, -255.0f, 255.0f);
1272 -350.0f, 350.0f, 0.405f, 4e-6f, -25.0f, 25.0f, 1.0f, 10.0f, -255.0f, 255.0f);
1274 -300.0f, 300.0f, 0.405f, 4e-6f, -10.0f, 10.0f, 1.0f, 25.0f, -255.0f, 255.0f);
1276 -500.0f, 500.0f, 0.405f, 4e-6f, -4.0f, 4.0f, 0.7f, 60.0f, -255.0f, 255.0f);
1284 : cur_set_thumb_opposition;
1287 : cur_set_distal_joint;
1291 : cur_set_proximal_joint;
1295 : cur_set_distal_joint;
1299 : cur_set_proximal_joint;
1302 : cur_set_outer_joint;
1304 : cur_set_outer_joint;
1307 : cur_set_finger_spread;
1309 return current_settings;
1318 std::vector<SVHPositionSettings> position_settings(
SVH_DIMENSION);
1329 -1.0e6f, 1.0e6f, 65.0e3f, 1.00f, 1e-3f, -500.0f, 500.0f, 0.5f, 0.0f, 400.0f);
1331 -1.0e6f, 1.0e6f, 50.0e3f, 1.00f, 1e-3f, -500.0f, 500.0f, 0.5f, 0.1f, 100.0f);
1333 -1.0e6f, 1.0e6f, 45.0e3f, 1.00f, 1e-3f, -500.0f, 500.0f, 0.5f, 0.0f, 40.0f);
1335 -1.0e6f, 1.0e6f, 40.0e3f, 1.00f, 1e-3f, -500.0f, 500.0f, 0.8f, 0.0f, 1000.0f);
1337 -1.0e6f, 1.0e6f, 45.0e3f, 1.00f, 1e-3f, -500.0f, 500.0f, 0.5f, 0.0f, 10.0f);
1339 -1.0e6f, 1.0e6f, 40.0e3f, 1.00f, 1e-3f, -500.0f, 500.0f, 0.8f, 0.0f, 1000.0f);
1341 -1.0e6f, 1.0e6f, 45.0e3f, 1.00f, 1e-3f, -500.0f, 500.0f, 0.5f, 0.0f, 100.0f);
1343 -1.0e6f, 1.0e6f, 45.0e3f, 1.00f, 1e-3f, -500.0f, 500.0f, 0.5f, 0.0f, 100.0f);
1345 -1.0e6f, 1.0e6f, 25.0e3f, 1.00f, 1e-3f, -500.0f, 500.0f, 0.5f, 0.0f, 100.0f);
1368 : pos_set_thumb_flexion;
1371 : pos_set_thumb_opposition;
1375 : pos_set_finger_index_distal;
1379 : pos_set_finger_index_proximal;
1383 : pos_set_finger_middle_distal;
1387 : pos_set_finger_middle_proximal;
1390 : pos_set_finger_ring;
1393 : pos_set_finger_pinky;
1408 return position_settings;
1413 if ((speed >= 0.0) && (speed <= 1.0))
1421 "The reset speed value given: " 1422 << speed <<
" is not valid. Please provide a value between 0.0 and 1.0, default is 0.2");
1429 int32_t target_position =
static_cast<int32_t
>(position /
m_ticks2rad[channel]);
1440 return target_position;
1446 int32_t cleared_position_ticks;
1457 return static_cast<double>(cleared_position_ticks *
m_ticks2rad[channel]);
1468 current =
static_cast<uint16_t
>(
1505 "Channel" << channel <<
" : " 1507 <<
" Target: " << target_position <<
"(" 1523 (reset_timeout > 0) ? std::chrono::seconds(reset_timeout) : std::chrono::seconds(0);
1528 if (max_force > 0 && max_force <= 1)
1537 "Maximal Force / current should be in the range of [0,1], was set to: " << max_force);
1551 current_settings.
wmx = current;
1552 current_settings.
wmn = -
static_cast<float>(current);
1566 const unsigned int& retry_count)
1571 bool was_connected =
true;
1575 was_connected =
false;
1593 unsigned int num_retries = retry_count;
1599 std::this_thread::sleep_for(std::chrono::microseconds(100000));
1607 "Getting Firmware Version failed,.Retrying, count: " << num_retries);
1637 SVH_LOG_WARN_STREAM(
"SVHFeedbackPollingThread",
"SCHUNK five finger hand is not connected!");
1639 std::this_thread::sleep_for(std::chrono::milliseconds(100));
SVHFirmwareInfo getFirmwareInfo()
get the latest stored Firmware information from the controller (NOT THE HARDWARE) ...
bool connect(const std::string &dev_name="/dev/ttyUSB0", const unsigned int &retry_count=3)
Open connection to SCHUNK five finger hand. Wait until expected return packages are received...
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.
float wmx
Reference signal maximum value.
double convertmAtoN(const SVHChannel &channel, const int16_t ¤t)
Converts joint currents of a specific channel from current [mA] to force [N] factoring the effort_con...
std::vector< bool > m_is_homed
vector storing reset flags for each channel
std::vector< bool > m_position_settings_given
float wmn
Reference signal minimum value.
void disableChannel(const SVHChannel &channel)
Disable one or all motor channels.
bool getPositionSettings(const SVHChannel &channel, SVHPositionSettings &position_settings)
returns actual position controller settings of channel
float maximum_offset
Maximum reachable tick limit, given as an offset from the hard stop (soft limit)
float minimum_offset
Minimum reachable tick limit, given as offset from the hard stop (soft limit)
std::vector< SVHCurrentSettings > m_current_settings
Vector of current controller parameters for each finger (as given by external config) ...
bool setCurrentSettings(const SVHChannel &channel, const SVHCurrentSettings ¤t_settings)
overwrite current parameters
void resetPackageCounts()
resetPackageCounts sets the sent and reveived package counts to zero
void setPositionSettings(const SVHChannel &channel, const SVHPositionSettings &position_settings)
activate a new set of position controller settings for a specific channel
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 ...
void disableChannel(const SVHChannel &channel)
disable controller of channel
float setForceLimit(const SVHChannel &channel, float force_limit)
setForceLimit set the force limit for the given channel
std::vector< bool > m_diagnostic_encoder_state
vectors storing diagnostic information, encoder state
int32_t convertRad2Ticks(const SVHChannel &channel, const double &position)
Converts joint positions of a specific channel from RAD to ticks factoring in the offset of the chann...
uint16_t convertNtomA(const SVHChannel &channel, const double &effort)
Converts joint efforts of a specific channel from force [N] to current [mA] factoring the effort_cons...
double diagnostic_current_maximum
double diagnostic_deadlock
void setResetTimeout(const int &reset_timeout)
setResetTimeout Helper function to set the timout durind rest of fingers
unsigned int getSentPackageCount()
requests the number of sent packages. Request ist transferred to the serial interface that knows abou...
bool setPositionSettings(const SVHChannel &channel, const SVHPositionSettings &position_settings)
overwrite position parameters
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
bool getHomeSettings(const SVHChannel &channel, SVHHomeSettings &home_settings)
returns actual home settings of channel
SVHFirmwareInfo m_firmware_info
Firmware info of the connected Hand.
int32_t position
Returned position value of the motor [Ticks].
int direction
Movement direction of the finger +1 or -1 home in positive or negative direction. ...
The SVHCurrentSettings save the current controller paramters for a single motor.
virtual ~SVHFingerManager()
bool getCurrent(const SVHChannel &channel, double ¤t)
returns current value of channel
#define SVH_LOG_INFO_STREAM(NAME, M)
static const float CHANNEL_EFFORT_CONSTANTS[9][2]
Effort multipliers to calculate the torque of the motors for the individual channels.
uint16_t version_minor
Minor version number.
bool getControllerFeedback(const SVHChannel &channel, SVHControllerFeedback &controller_feedback)
request the latest stored controllerfeedback (current, position) from the controller.
std::vector< double > m_diagnostic_current_maximum
vectors storing diagnostic information, current maximum
bool connect(const std::string &dev_name)
Open serial device connection.
bool m_connection_feedback_given
SVHFirmwareInfo getFirmwareInfo(const std::string &dev_name="/dev/ttyUSB0", const unsigned int &retry_count=3)
getFirmwareInfo Requests the firmware information from the harware, waits a bit and returns the last ...
unsigned int getReceivedPackageCount()
request the number of correctly received packages. This number is refreshed every time the serialinte...
void requestControllerState()
Request current controller state (mainly usefull for debug purposes)
bool setMaxForce(float max_force)
setMaxForce set the max force / current as a persentage of the maximum possible current ...
bool isConnected()
returns connected state of finger manager
float reset_current_factor
std::string m_serial_device
m_serial_device Device handle of the device to use, is overwritten if connect is called with an argum...
void requestControllerState()
float dwmx
Reference signal delta maximum threshold.
bool resetChannel(const SVHChannel &channel)
reset function for channel
bool setAllTargetPositions(const std::vector< double > &positions)
set all target positions at once
void setControllerTarget(const SVHChannel &channel, const int32_t &position)
Set new position target for finger index.
std::vector< int32_t > m_position_min
min position vector for each channel
float wmx
Reference signal maximum value.
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)
void pollFeedback()
Periodically poll feedback from the hardware.
bool isEnabled(const SVHChannel &channel)
Check if a channel was enabled.
bool isEnabled(const SVHChannel &channel)
returns true, if current channel has been enabled
#define SVH_LOG_DEBUG_STREAM(NAME, M)
#define SVH_LOG_ERROR_STREAM(NAME, M)
double convertTicks2Rad(const SVHChannel &channel, const int32_t &ticks)
Converts joint positions of a specific channel from ticks to RAD factoring in the offset of the chann...
std::vector< SVHPositionSettings > m_position_settings
Vector of position controller parameters for each finger (as given by external config) ...
double diagnostic_current_minimum
void requestControllerFeedback(const SVHChannel &channel)
request feedback (position and current) to a specific channel
std::vector< int32_t > m_position_home
home position after complete reset of each channel
void setCurrentSettings(const SVHChannel &channel, const SVHCurrentSettings ¤t_settings)
activate a new set of current controller settings for a specific channel
The SVHFirmwareInfo holds the data of a firmware response from the hardware.
The SVHControllerFeedback saves the feedback of a single motor.
void disconnect()
disconnect serial device
bool setTargetPosition(const SVHChannel &channel, double position, double current)
set target position of a channel
bool getPositionSettings(const SVHChannel &channel, SVHPositionSettings &position_settings)
request the latest stored positionsettings from the controller
uint16_t version_major
Major version number.
bool isHomed(const SVHChannel &channel)
returns true, if current channel has been resetted
static const char * m_channel_description[]
Description values to get the corresponding string value to a channel enum.
std::vector< bool > m_is_switched_off
int16_t current
Returned current value of the motor [mA].
bool getCurrentSettings(const SVHChannel &channel, SVHCurrentSettings ¤t_settings)
request the latest stored currentsettings from the controller
bool m_connected
holds the connected state
std::atomic< bool > m_poll_feedback
Flag whether to poll feedback periodically in the feedback thread.
float wmn
Reference signal minimum value.
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.
This class controls the the SCHUNK five finger hand.
void disconnect()
disconnect SCHUNK five finger hand
void setControllerTargetAllChannels(const std::vector< int32_t > &positions)
Setting new position controller target for all fingers.
std::vector< SVHCurrentSettings > getDefaultCurrentSettings()
get default current settings. These are either values previously set from calling software or hardcod...
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
bool resetDiagnosticData(const SVHChannel &channel)
resetDiagnosticData reset the diagnostic data vectors
bool enableChannel(const SVHChannel &channel)
enable controller of channel
bool requestControllerFeedback(const SVHChannel &channel)
send request controller feedback paket
void setResetSpeed(const float &speed)
setResetSpeed Set the speed percentage during reset
double diagnostic_position_minimum
bool isInsideBounds(const SVHChannel &channel, const int32_t &target_position)
Check bounds of target positions.
void setDefaultHomeSettings()
initialize the homing settings with hardcoded defaults. These can be overwritten by the setHomeSettin...
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
bool setHomeSettings(const SVHChannel &channel, const SVHHomeSettings &home_settings)
setHomeSettings set the home Settings which are maily used doring reset and provide the soft limit fo...
bool getPosition(const SVHChannel &channel, double &position)
returns position value of channel (will not acces hardware but return latest value) ...
bool getCurrentSettings(const SVHChannel &channel, SVHCurrentSettings ¤t_settings)
returns actual current controller settings of channel
SVHFingerManager(const std::vector< bool > &disable_mask=std::vector< bool >(9, false), const uint32_t &reset_timeout=5)
std::vector< bool > m_current_settings_given
#define SVH_LOG_WARN_STREAM(NAME, M)
std::vector< SVHPositionSettings > getDefaultPositionSettings(const bool &reset=false)
get default position settings. These are either values previously set from calling software or hardco...
std::vector< bool > m_diagnostic_current_state
vectors storing diagnostic information, current state
bool currentSettingsAreSafe(const SVHChannel &channel, const SVHCurrentSettings ¤t_settings)
currentSettingsAreSafe helper function to check for the most important values of the current settings...
SVHController * m_controller
pointer to svh controller
bool diagnostic_encoder_state
void requestFirmwareInfo()
request a transmission of formware information
bool getDiagnosticStatus(const SVHChannel &channel, struct DiagnosticState &diagnostic_status)
returns actual diagnostic status of channel
void enableChannel(const SVHChannel &channel)
Enable one or all motor channels.