Classes |
class | cCANSerial_ESD_Internal |
| internal hardware specific implementation details of the lowlevel ESD CAN interface More...
|
class | cCANSerial_ESDException |
| Derived exception class for low-level CAN ESD related exceptions. More...
|
class | cCANSerial_ESD |
| Low-level communication class to access a CAN port from company ESD (http://www.esd.eu/) More...
|
class | cCANSerial_PEAK_Internal |
| internal hardware specific implementation details of the lowlevel PEAK CAN interface More...
|
class | cCANSerial_PEAKException |
| Derived exception class for low-level CAN PEAK related exceptions. More...
|
class | cCANSerial_PEAK |
| Low-level communication class to access a CAN port from company PEAK (http://www.peak-system.com) More...
|
class | cCRC |
| Cyclic Redundancy Code checker class, used for protecting communication against transmission errors. More...
|
class | cCRC_DSACON32m |
| A derived CRC class that uses a CRC table and initial value suitable for the Weiss Robotics DSACON32m controller. More...
|
class | cCRC_SDH |
| A derived CRC class that uses a CRC table and initial value suitable for protecing the binary communication with SDH via RS232. More...
|
class | cDBG |
| A class to print colored debug messages. More...
|
class | cHexByteString |
| dummy class for (debug) stream output of bytes as list of hex values More...
|
class | cDSAException |
| Derived exception class for low-level DSA related exceptions. More...
|
class | cDSA |
| SDH::cDSA is the end user interface class to access the DSACON32m, the tactile sensor controller of the SDH. More...
|
class | cRS232Exception |
| Derived exception class for low-level RS232 related exceptions. More...
|
class | cRS232 |
| Low-level communication class to access a serial port on Cygwin and Linux. More...
|
class | cSDH |
| SDH::cSDH is the end user interface class to control a SDH (SCHUNK Dexterous Hand). More...
|
class | cSDHErrorInvalidParameter |
| Derived exception class for exceptions related to invalid parameters. More...
|
class | cSDHBase |
| The base class to control the SCHUNK Dexterous Hand. More...
|
class | cMsg |
| Class for short, fixed maximum length text messages. More...
|
class | cSDHLibraryException |
| Base class for exceptions in the SDHLibrary-CPP. More...
|
class | cSDHErrorCommunication |
| Derived exception class for exceptions related to communication between the SDHLibrary and the SDH. More...
|
struct | sSDHBinaryRequest |
| data structure with binary data for request from PC to SDH More...
|
struct | sSDHBinaryResponse |
| data structure with binary data for response from SDH to PC More...
|
class | cSDHSerial |
| The class to communicate with a SDH via RS232. More...
|
class | cSerialBaseException |
| Derived exception class for low-level serial communication related exceptions. More...
|
class | cSerialBase |
| Low-level communication class to access a serial port. More...
|
class | cSimpleStringList |
| A simple string list. (Fixed maximum number of strings of fixed maximum length) More...
|
class | cSimpleTime |
| Very simple class to measure elapsed time. More...
|
class | cSimpleVectorException |
| Derived exception class for low-level simple vector related exceptions. More...
|
class | cSimpleVector |
| A simple vector implementation. More...
|
class | cTCPSerialException |
| Derived exception class for low-level CAN ESD related exceptions. More...
|
class | cTCPSerial |
| Low-level communication class to access a CAN port. More...
|
class | cUnitConverter |
| Unit conversion class to convert values between physical unit systems. More...
|
class | cSetValueTemporarily |
| helper class to set value on construction and reset to previous value on destruction. (RAII-idiom) More...
|
Typedefs |
typedef int8_t | Int8 |
| signed integer, size 1 Byte (8 Bit)
|
typedef uint8_t | UInt8 |
| unsigned integer, size 1 Byte (8 Bit)
|
typedef int16_t | Int16 |
| signed integer, size 2 Byte (16 Bit)
|
typedef uint16_t | UInt16 |
| unsigned integer, size 2 Byte (16 Bit)
|
typedef int32_t | Int32 |
| signed integer, size 4 Byte (32 Bit)
|
typedef uint32_t | UInt32 |
| unsigned integer, size 4 Byte (32 Bit)
|
typedef void * | PCAN_HANDLE |
| Linux libpcan uses HANDLE where Windows Pcan_usb.h uses no handle at all:
|
typedef UInt16 | tCRCValue |
| the data type used to calculate and exchange CRC values with DSACON32m (16 bit integer)
|
typedef cSimpleVector(cSDHSerial::* | pSetFunction )(int, double *) |
| Type of a pointer to a "set-axis-values" function like cSDHSerial::p, cSDHSerial::pos, ..., cSDHSerial::igrip, cSDHSerial::ihold or cSDHSerial::ilim.
|
typedef cSimpleVector(cSDHSerial::* | pGetFunction )(int, double *) |
| Type of a pointer to a "get-axis-values" function like cSDHSerial::p, cSDHSerial::pos, ..., cSDHSerial::igrip, cSDHSerial::ihold or cSDHSerial::ilim.
|
typedef void * | tDeviceHandle |
| generic device handle for CAN devices
|
typedef time_t | tTimevalSec |
typedef suseconds_t | tTimevalUSec |
typedef double(cUnitConverter::* | pDoubleUnitConverterFunction )(double) const |
| Type of a pointer to a function like 'double SDH::cUnitConverter::ToExternal( double ) const' or 'double SDH::cUnitConverter::ToInternal( double ) const'.
|
Enumerations |
enum | { eNUMBER_OF_ELEMENTS = cSimpleVector::eNUMBER_OF_ELEMENTS
} |
Functions |
VCC_EXPORT std::ostream & | operator<< (std::ostream &stream, cHexByteString const &s) |
| output the bytes in s to stream as a list of space separated hex bytes (without 0x prefix)
|
std::ostream & | operator<< (std::ostream &stream, cDSA::sResponse const &response) |
VCC_EXPORT std::ostream & | operator<< (std::ostream &stream, cDSA::sControllerInfo const &controller_info) |
VCC_EXPORT std::ostream & | operator<< (std::ostream &stream, cDSA::sSensorInfo const &sensor_info) |
VCC_EXPORT std::ostream & | operator<< (std::ostream &stream, cDSA::sMatrixInfo const &matrix_info) |
VCC_EXPORT std::ostream & | operator<< (std::ostream &stream, cDSA const &dsa) |
char const * | SDHCommandCodeToString (eCommandCode cc) |
char const * | SDHReturnCodeToString (eReturnCode rc) |
std::ostream & | operator<< (std::ostream &stream, cMsg const &msg) |
std::ostream & | operator<< (std::ostream &stream, cSDHLibraryException const &e) |
struct SDH::sSDHBinaryRequest | __attribute__ ((packed)) |
std::ostream & | operator<< (std::ostream &stream, sSDHBinaryRequest const &request) |
| helper functions to insert a human readable form of the request into stream
|
std::ostream & | operator<< (std::ostream &stream, sSDHBinaryResponse const &response) |
| helper functions to insert a human readable form of the restore into stream
|
std::ostream & | operator<< (std::ostream &stream, cSimpleStringList const &ssl) |
| Output of cSimpleStringList objects in 'normal' output streams.
|
std::vector< int > | NumerifyRelease (char const *rev) |
|
|
bool | InIndex (int v, int max) |
bool | InRange (double v, double min, double max) |
bool | InRange (int n, double const *v, double const *min, double const *max) |
double | ToRange (double v, double min, double max) |
void | ToRange (int n, double *v, double const *min, double const *max) |
void | ToRange (std::vector< double > &v, std::vector< double > const &min, std::vector< double > const &max) |
void | ToRange (cSimpleVector &v, std::vector< double > const &min, std::vector< double > const &max) |
double | Approx (double a, double b, double eps) |
bool | Approx (int n, double *a, double *b, double *eps) |
double | DegToRad (double d) |
double | RadToDeg (double r) |
void | SleepSec (double t) |
int | CompareReleases (char const *rev1, char const *rev2) |
| compare release strings
|
template<typename Function , typename Tp > |
void | apply (Function f, Tp &sequence) |
template<typename Function , typename InputIterator > |
Function | apply (Function f, InputIterator first, InputIterator last) |
template<typename Function , typename Tp > |
Tp | map (Function f, Tp sequence) |
template<typename T > |
std::ostream & | operator<< (std::ostream &stream, std::vector< T > const &v) |
Variables |
SDH::cRS232Exception | SDH__attribute__ |
std::ostream * | g_sdh_debug_log = &std::cerr |
cUnitConverter const | uc_identity ("any","any","?", 1.0, 0.0, 4) |
| Identity converter (internal = external)
|
A namespace for all classes and functions in the SDHLibrary.
The use of the namespace can be disabled at compile time of the library by setting SDH_USE_NAMESPACE to 0.