SVHFingerManager.h
Go to the documentation of this file.
1 //
3 // © Copyright 2022 SCHUNK Mobile Greifsysteme GmbH, Lauffen/Neckar Germany
4 // © Copyright 2022 FZI Forschungszentrum Informatik, Karlsruhe, Germany
5 //
6 // This file is part of the Schunk SVH Library.
7 //
8 // The Schunk SVH Library is free software: you can redistribute it and/or
9 // modify it under the terms of the GNU General Public License as published by
10 // the Free Software Foundation, either version 3 of the License, or (at your
11 // option) any later version.
12 //
13 // The Schunk SVH Library is distributed in the hope that it will be useful,
14 // but WITHOUT ANY WARRANTY; without even the implied warranty of
15 // MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU General
16 // Public License for more details.
17 //
18 // You should have received a copy of the GNU General Public License along with
19 // the Schunk SVH Library. If not, see <https://www.gnu.org/licenses/>.
20 //
22 
23 //----------------------------------------------------------------------
36 //----------------------------------------------------------------------
37 #ifndef DRIVER_SVH_SVH_FINGER_MANAGER_H_INCLUDED
38 #define DRIVER_SVH_SVH_FINGER_MANAGER_H_INCLUDED
39 
40 #include <chrono>
46 
47 #include <memory>
48 #include <thread>
49 
50 
51 namespace driver_svh {
52 
56 {
57 public:
62  enum Hints
63  {
64  HT_DEVICE_NOT_FOUND, /* ttyUSBx could not be found */
65  HT_CONNECTION_FAILED, /* ttyUSB could be opened but communication failed */
66  HT_NOT_RESETTED, /* the fingers of the hand are not resetted */
67  HT_NOT_CONNECTED, /* simply never called connect */
68  HT_RESET_FAILED, /* timeout during reset -> this is a serious failure */
69  HT_CHANNEL_SWITCHED_OF, /* Not realy a problem, however a hint worth noting */
70  HT_DANGEROUS_CURRENTS, /* Current Values are set to dangerous levels */
71  HT_DIMENSION /* dummy entry indicating the size, not used as status */
72  };
73 
75  {
83  };
84 
89  SVHFingerManager(const std::vector<bool>& disable_mask = std::vector<bool>(9, false),
90  const uint32_t& reset_timeout = 5);
91 
92  virtual ~SVHFingerManager();
93 
100  bool connect(const std::string& dev_name = "/dev/ttyUSB0", const unsigned int& retry_count = 3);
101 
105  void disconnect();
106 
111  bool isConnected() { return m_connected; }
112 
118  bool resetChannel(const SVHChannel& channel);
119 
125  bool enableChannel(const SVHChannel& channel);
126 
131  void disableChannel(const SVHChannel& channel);
132 
137  bool requestControllerFeedbackAllChannels();
138 
144  bool requestControllerFeedback(const SVHChannel& channel);
145 
152  bool getPosition(const SVHChannel& channel, double& position);
153 
160  bool getCurrent(const SVHChannel& channel, double& current);
161 
162 
170  bool setAllTargetPositions(const std::vector<double>& positions);
171 
179  bool setTargetPosition(const SVHChannel& channel, double position, double current);
180 
186  bool isEnabled(const SVHChannel& channel);
187 
193  bool isHomed(const SVHChannel& channel);
194 
197  void requestControllerState();
198 
205  bool getCurrentSettings(const SVHChannel& channel, SVHCurrentSettings& current_settings);
206 
213  bool getPositionSettings(const SVHChannel& channel, SVHPositionSettings& position_settings);
214 
221  bool getHomeSettings(const SVHChannel& channel, SVHHomeSettings& home_settings);
222 
229  bool getDiagnosticStatus(const SVHChannel& channel, struct DiagnosticState& diagnostic_status);
230 
237  bool setCurrentSettings(const SVHChannel& channel, const SVHCurrentSettings& current_settings);
238 
245  bool setPositionSettings(const SVHChannel& channel, const SVHPositionSettings& position_settings);
246 
253  bool setHomeSettings(const SVHChannel& channel, const SVHHomeSettings& home_settings);
254 
260  bool resetDiagnosticData(const SVHChannel& channel);
261 
262 
263  // These 3 functions could be private but where made public for printing and debug purposes. As
264  // there is no harm to it it should not be a problem
265 
268  std::vector<SVHCurrentSettings> getDefaultCurrentSettings();
269 
273  std::vector<SVHPositionSettings> getDefaultPositionSettings(const bool& reset = false);
274 
277  void setDefaultHomeSettings();
278 
283  void setResetSpeed(const float& speed);
284 
289  void setResetTimeout(const int& reset_timeout);
290 
296  bool setMaxForce(float max_force);
297 
304  float setForceLimit(const SVHChannel& channel, float force_limit);
305 
312  double convertmAtoN(const SVHChannel& channel, const int16_t& current);
313 
322  SVHFirmwareInfo getFirmwareInfo(const std::string& dev_name = "/dev/ttyUSB0",
323  const unsigned int& retry_count = 3);
324 
325 
326  // ----------------------------------------------------------------------
327  // ---- private functions and varaibles
328  // ----------------------------------------------------------------------
329 
330 private:
333 
335  std::atomic<bool> m_poll_feedback;
336 
338  std::thread m_feedback_thread;
339 
342 
346 
348  std::chrono::seconds m_homing_timeout;
349 
353 
355  std::vector<double> m_ticks2rad;
356 
358  std::vector<int32_t> m_position_min;
359 
361  std::vector<int32_t> m_position_max;
362 
364  std::vector<int32_t> m_position_home;
365 
367  std::vector<bool> m_is_homed;
368 
371  std::vector<bool> m_is_switched_off;
372 
374  std::vector<bool> m_diagnostic_encoder_state;
375 
377  std::vector<bool> m_diagnostic_current_state;
378 
380  std::vector<double> m_diagnostic_current_maximum;
381 
383  std::vector<double> m_diagnostic_current_minimum;
384 
386  std::vector<double> m_diagnostic_position_maximum;
387 
389  std::vector<double> m_diagnostic_position_minimum;
390 
392  std::vector<double> m_diagnostic_deadlock;
393 
396 
398  std::chrono::seconds m_reset_timeout;
399 
401  std::vector<SVHCurrentSettings> m_current_settings;
402 
405  std::vector<bool> m_current_settings_given;
406 
408  std::vector<SVHPositionSettings> m_position_settings;
411  std::vector<bool> m_position_settings_given;
412 
414  std::vector<SVHHomeSettings> m_home_settings;
415 
418 
423  std::string m_serial_device;
424 
426  std::vector<SVHChannel> m_reset_order;
427 
435  std::vector<double> m_reset_current_factor;
436 
443  int32_t convertRad2Ticks(const SVHChannel& channel, const double& position);
444 
451  double convertTicks2Rad(const SVHChannel& channel, const int32_t& ticks);
452 
458  uint16_t convertNtomA(const SVHChannel& channel, const double& effort);
459 
466  bool isInsideBounds(const SVHChannel& channel, const int32_t& target_position);
467 
474  bool currentSettingsAreSafe(const SVHChannel& channel,
475  const SVHCurrentSettings& current_settings);
476 
483  void pollFeedback();
484 
485  // DEBUG
487 };
488 
489 } // namespace driver_svh
490 
491 #endif
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
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
Definition: ImportExport.h:50
std::vector< double > m_diagnostic_current_maximum
vectors storing diagnostic information, current maximum
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) ...
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.
Definition: SVHController.h:87
SVHControllerFeedback m_debug_feedback
The SVHPositionSettings save the position controller paramters for a single motor.
std::vector< double > m_diagnostic_current_minimum
vectors storing diagnostic information, current 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


schunk_svh_library
Author(s): Georg Heppner, Lars Pfotzer, Felix Exner, Johannes Mangler, Stefan Scherzinger, Pascal Becker
autogenerated on Fri Apr 14 2023 02:26:23