Public Member Functions | Protected Member Functions | Protected Attributes | Friends | List of all members
youbot::YouBotJointParameterReadOnly Class Referenceabstract

abstract youBot joint parameter which can be read only More...

#include <YouBotJointParameterReadOnly.hpp>

Inheritance diagram for youbot::YouBotJointParameterReadOnly:
Inheritance graph
[legend]

Public Member Functions

virtual void toString (std::string &value)=0
 
virtual ~YouBotJointParameterReadOnly ()
 

Protected Member Functions

virtual std::string getName () const =0
 
virtual ParameterType getType () const =0
 
virtual void getYouBotMailboxMsg (YouBotSlaveMailboxMsg &message, TMCLCommandNumber msgType, const YouBotJointStorage &storage) const =0
 
virtual void setYouBotMailboxMsg (const YouBotSlaveMailboxMsg &message, const YouBotJointStorage &storage)=0
 
 YouBotJointParameterReadOnly ()
 

Protected Attributes

std::string name
 
ParameterType parameterType
 

Friends

class YouBotJoint
 

Detailed Description

abstract youBot joint parameter which can be read only

Definition at line 70 of file YouBotJointParameterReadOnly.hpp.

Constructor & Destructor Documentation

youbot::YouBotJointParameterReadOnly::YouBotJointParameterReadOnly ( )
protected

Definition at line 54 of file YouBotJointParameterReadOnly.cpp.

youbot::YouBotJointParameterReadOnly::~YouBotJointParameterReadOnly ( )
virtual

Definition at line 59 of file YouBotJointParameterReadOnly.cpp.

Member Function Documentation

virtual std::string youbot::YouBotJointParameterReadOnly::getName ( ) const
protectedpure virtual

Implemented in youbot::ClearMotorControllerTimeoutFlag, youbot::ClearI2tExceededFlag, youbot::PositionTargetReachedDistance, youbot::MaximumVelocityToSetPosition, youbot::IClippingParameterCurrentControl, youbot::DParameterCurrentControl, youbot::IParameterCurrentControl, youbot::PParameterCurrentControl, youbot::IClippingParameterSecondParametersSpeedControl, youbot::DParameterSecondParametersSpeedControl, youbot::IParameterSecondParametersSpeedControl, youbot::MotorHaltedVelocity, youbot::PParameterSecondParametersSpeedControl, youbot::ThermalWindingTimeConstant, youbot::IClippingParameterSecondParametersPositionControl, youbot::StopSwitchPolarity, youbot::DParameterSecondParametersPositionControl, youbot::IParameterSecondParametersPositionControl, youbot::SineInitializationVelocity, youbot::PParameterSecondParametersPositionControl, youbot::SetEncoderCounterZeroOnlyOnce, youbot::SetEncoderCounterZeroAtNextSwitch, youbot::IClippingParameterFirstParametersSpeedControl, youbot::SetEncoderCounterZeroAtNextNChannel, youbot::DParameterFirstParametersSpeedControl, youbot::ReversingEncoderDirection, youbot::IParameterFirstParametersSpeedControl, youbot::PIDControlTime, youbot::PParameterFirstParametersSpeedControl, youbot::OperationalTime, youbot::IClippingParameterFirstParametersPositionControl, youbot::MotorPoles, youbot::DParameterFirstParametersPositionControl, youbot::MotorControllerTimeout, youbot::IParameterFirstParametersPositionControl, youbot::MotorCoilResistance, youbot::PParameterFirstParametersPositionControl, youbot::MaximumMotorCurrent, youbot::VelocityThresholdForHallFX, youbot::MassInertiaConstant, youbot::SpeedControlSwitchingThreshold, youbot::InitSineDelay, youbot::PositionControlSwitchingThreshold, youbot::InitializationMode, youbot::RampGeneratorSpeedAndPositionControl, youbot::I2tLimit, youbot::MotorAcceleration, youbot::I2tExceedCounter, youbot::MaximumPositioningVelocity, youbot::ActualModuleSupplyCurrent, youbot::HallSensorPolarityReversal, youbot::ActualMotorDriverTemperature, youbot::EncoderStopSwitch, youbot::I2tSum, youbot::EncoderResolution, youbot::RampGeneratorSpeed, youbot::CurrentErrorSum, youbot::CurrentControlLoopDelay, youbot::CurrentError, youbot::CommutationMotorCurrent, youbot::VelocityErrorSum, youbot::CommutationMode, youbot::VelocityError, youbot::BEMFConstant, youbot::PositionErrorSum, youbot::PositionError, youbot::ApproveProtectedParameters, youbot::InitializeJoint, youbot::ErrorAndStatus, youbot::ActualCommutationOffset, youbot::ActivateOvervoltageProtection, youbot::ActualMotorVoltage, youbot::YouBotJointParameter, and youbot::YouBotJointParameterPasswordProtected.

virtual ParameterType youbot::YouBotJointParameterReadOnly::getType ( ) const
protectedpure virtual

Implemented in youbot::ClearMotorControllerTimeoutFlag, youbot::ClearI2tExceededFlag, youbot::PositionTargetReachedDistance, youbot::MaximumVelocityToSetPosition, youbot::IClippingParameterCurrentControl, youbot::DParameterCurrentControl, youbot::IParameterCurrentControl, youbot::PParameterCurrentControl, youbot::IClippingParameterSecondParametersSpeedControl, youbot::DParameterSecondParametersSpeedControl, youbot::IParameterSecondParametersSpeedControl, youbot::MotorHaltedVelocity, youbot::PParameterSecondParametersSpeedControl, youbot::ThermalWindingTimeConstant, youbot::IClippingParameterSecondParametersPositionControl, youbot::StopSwitchPolarity, youbot::DParameterSecondParametersPositionControl, youbot::IParameterSecondParametersPositionControl, youbot::SineInitializationVelocity, youbot::PParameterSecondParametersPositionControl, youbot::SetEncoderCounterZeroOnlyOnce, youbot::SetEncoderCounterZeroAtNextSwitch, youbot::IClippingParameterFirstParametersSpeedControl, youbot::SetEncoderCounterZeroAtNextNChannel, youbot::DParameterFirstParametersSpeedControl, youbot::ReversingEncoderDirection, youbot::IParameterFirstParametersSpeedControl, youbot::PIDControlTime, youbot::PParameterFirstParametersSpeedControl, youbot::OperationalTime, youbot::IClippingParameterFirstParametersPositionControl, youbot::MotorPoles, youbot::DParameterFirstParametersPositionControl, youbot::MotorControllerTimeout, youbot::IParameterFirstParametersPositionControl, youbot::MotorCoilResistance, youbot::PParameterFirstParametersPositionControl, youbot::MaximumMotorCurrent, youbot::VelocityThresholdForHallFX, youbot::MassInertiaConstant, youbot::SpeedControlSwitchingThreshold, youbot::InitSineDelay, youbot::PositionControlSwitchingThreshold, youbot::InitializationMode, youbot::RampGeneratorSpeedAndPositionControl, youbot::I2tLimit, youbot::MotorAcceleration, youbot::I2tExceedCounter, youbot::MaximumPositioningVelocity, youbot::ActualModuleSupplyCurrent, youbot::HallSensorPolarityReversal, youbot::ActualMotorDriverTemperature, youbot::EncoderStopSwitch, youbot::I2tSum, youbot::EncoderResolution, youbot::RampGeneratorSpeed, youbot::CurrentErrorSum, youbot::CurrentControlLoopDelay, youbot::CurrentError, youbot::CommutationMotorCurrent, youbot::VelocityErrorSum, youbot::CommutationMode, youbot::VelocityError, youbot::BEMFConstant, youbot::PositionErrorSum, youbot::PositionError, youbot::ApproveProtectedParameters, youbot::InitializeJoint, youbot::ErrorAndStatus, youbot::ActualCommutationOffset, youbot::ActivateOvervoltageProtection, youbot::ActualMotorVoltage, youbot::YouBotJointParameter, and youbot::YouBotJointParameterPasswordProtected.

virtual void youbot::YouBotJointParameterReadOnly::getYouBotMailboxMsg ( YouBotSlaveMailboxMsg message,
TMCLCommandNumber  msgType,
const YouBotJointStorage storage 
) const
protectedpure virtual

Implemented in youbot::ClearMotorControllerTimeoutFlag, youbot::ClearI2tExceededFlag, youbot::PositionTargetReachedDistance, youbot::MaximumVelocityToSetPosition, youbot::IClippingParameterCurrentControl, youbot::DParameterCurrentControl, youbot::IParameterCurrentControl, youbot::PParameterCurrentControl, youbot::IClippingParameterSecondParametersSpeedControl, youbot::DParameterSecondParametersSpeedControl, youbot::IParameterSecondParametersSpeedControl, youbot::MotorHaltedVelocity, youbot::PParameterSecondParametersSpeedControl, youbot::ThermalWindingTimeConstant, youbot::IClippingParameterSecondParametersPositionControl, youbot::StopSwitchPolarity, youbot::DParameterSecondParametersPositionControl, youbot::IParameterSecondParametersPositionControl, youbot::SineInitializationVelocity, youbot::PParameterSecondParametersPositionControl, youbot::SetEncoderCounterZeroOnlyOnce, youbot::SetEncoderCounterZeroAtNextSwitch, youbot::IClippingParameterFirstParametersSpeedControl, youbot::SetEncoderCounterZeroAtNextNChannel, youbot::DParameterFirstParametersSpeedControl, youbot::ReversingEncoderDirection, youbot::IParameterFirstParametersSpeedControl, youbot::PIDControlTime, youbot::PParameterFirstParametersSpeedControl, youbot::OperationalTime, youbot::IClippingParameterFirstParametersPositionControl, youbot::MotorPoles, youbot::DParameterFirstParametersPositionControl, youbot::MotorControllerTimeout, youbot::IParameterFirstParametersPositionControl, youbot::MotorCoilResistance, youbot::PParameterFirstParametersPositionControl, youbot::MaximumMotorCurrent, youbot::VelocityThresholdForHallFX, youbot::MassInertiaConstant, youbot::SpeedControlSwitchingThreshold, youbot::InitSineDelay, youbot::PositionControlSwitchingThreshold, youbot::InitializationMode, youbot::RampGeneratorSpeedAndPositionControl, youbot::I2tLimit, youbot::MotorAcceleration, youbot::I2tExceedCounter, youbot::MaximumPositioningVelocity, youbot::ActualModuleSupplyCurrent, youbot::HallSensorPolarityReversal, youbot::ActualMotorDriverTemperature, youbot::EncoderStopSwitch, youbot::I2tSum, youbot::EncoderResolution, youbot::RampGeneratorSpeed, youbot::CurrentErrorSum, youbot::CurrentControlLoopDelay, youbot::CurrentError, youbot::CommutationMotorCurrent, youbot::VelocityErrorSum, youbot::CommutationMode, youbot::VelocityError, youbot::BEMFConstant, youbot::PositionErrorSum, youbot::PositionError, youbot::ApproveProtectedParameters, youbot::InitializeJoint, youbot::ErrorAndStatus, youbot::ActualCommutationOffset, youbot::ActivateOvervoltageProtection, youbot::ActualMotorVoltage, youbot::YouBotJointParameter, and youbot::YouBotJointParameterPasswordProtected.

virtual void youbot::YouBotJointParameterReadOnly::setYouBotMailboxMsg ( const YouBotSlaveMailboxMsg message,
const YouBotJointStorage storage 
)
protectedpure virtual

Implemented in youbot::ClearMotorControllerTimeoutFlag, youbot::ClearI2tExceededFlag, youbot::PositionTargetReachedDistance, youbot::MaximumVelocityToSetPosition, youbot::IClippingParameterCurrentControl, youbot::DParameterCurrentControl, youbot::IParameterCurrentControl, youbot::PParameterCurrentControl, youbot::IClippingParameterSecondParametersSpeedControl, youbot::DParameterSecondParametersSpeedControl, youbot::IParameterSecondParametersSpeedControl, youbot::MotorHaltedVelocity, youbot::PParameterSecondParametersSpeedControl, youbot::ThermalWindingTimeConstant, youbot::IClippingParameterSecondParametersPositionControl, youbot::StopSwitchPolarity, youbot::DParameterSecondParametersPositionControl, youbot::IParameterSecondParametersPositionControl, youbot::SineInitializationVelocity, youbot::PParameterSecondParametersPositionControl, youbot::SetEncoderCounterZeroOnlyOnce, youbot::SetEncoderCounterZeroAtNextSwitch, youbot::IClippingParameterFirstParametersSpeedControl, youbot::SetEncoderCounterZeroAtNextNChannel, youbot::DParameterFirstParametersSpeedControl, youbot::ReversingEncoderDirection, youbot::IParameterFirstParametersSpeedControl, youbot::PIDControlTime, youbot::PParameterFirstParametersSpeedControl, youbot::OperationalTime, youbot::IClippingParameterFirstParametersPositionControl, youbot::MotorPoles, youbot::DParameterFirstParametersPositionControl, youbot::MotorControllerTimeout, youbot::IParameterFirstParametersPositionControl, youbot::MotorCoilResistance, youbot::PParameterFirstParametersPositionControl, youbot::MaximumMotorCurrent, youbot::VelocityThresholdForHallFX, youbot::MassInertiaConstant, youbot::SpeedControlSwitchingThreshold, youbot::InitSineDelay, youbot::PositionControlSwitchingThreshold, youbot::InitializationMode, youbot::RampGeneratorSpeedAndPositionControl, youbot::I2tLimit, youbot::MotorAcceleration, youbot::I2tExceedCounter, youbot::MaximumPositioningVelocity, youbot::ActualModuleSupplyCurrent, youbot::HallSensorPolarityReversal, youbot::ActualMotorDriverTemperature, youbot::EncoderStopSwitch, youbot::I2tSum, youbot::EncoderResolution, youbot::RampGeneratorSpeed, youbot::CurrentErrorSum, youbot::CurrentControlLoopDelay, youbot::CurrentError, youbot::CommutationMotorCurrent, youbot::VelocityErrorSum, youbot::CommutationMode, youbot::VelocityError, youbot::BEMFConstant, youbot::PositionErrorSum, youbot::PositionError, youbot::ApproveProtectedParameters, youbot::InitializeJoint, youbot::ErrorAndStatus, youbot::ActualCommutationOffset, youbot::ActivateOvervoltageProtection, youbot::ActualMotorVoltage, youbot::YouBotJointParameter, and youbot::YouBotJointParameterPasswordProtected.

virtual void youbot::YouBotJointParameterReadOnly::toString ( std::string &  value)
pure virtual

Implemented in youbot::ClearMotorControllerTimeoutFlag, youbot::ClearI2tExceededFlag, youbot::PositionTargetReachedDistance, youbot::MaximumVelocityToSetPosition, youbot::IClippingParameterCurrentControl, youbot::DParameterCurrentControl, youbot::IParameterCurrentControl, youbot::PParameterCurrentControl, youbot::IClippingParameterSecondParametersSpeedControl, youbot::DParameterSecondParametersSpeedControl, youbot::IParameterSecondParametersSpeedControl, youbot::MotorHaltedVelocity, youbot::PParameterSecondParametersSpeedControl, youbot::ThermalWindingTimeConstant, youbot::IClippingParameterSecondParametersPositionControl, youbot::StopSwitchPolarity, youbot::DParameterSecondParametersPositionControl, youbot::IParameterSecondParametersPositionControl, youbot::SineInitializationVelocity, youbot::PParameterSecondParametersPositionControl, youbot::SetEncoderCounterZeroOnlyOnce, youbot::SetEncoderCounterZeroAtNextSwitch, youbot::IClippingParameterFirstParametersSpeedControl, youbot::SetEncoderCounterZeroAtNextNChannel, youbot::DParameterFirstParametersSpeedControl, youbot::ReversingEncoderDirection, youbot::IParameterFirstParametersSpeedControl, youbot::PIDControlTime, youbot::PParameterFirstParametersSpeedControl, youbot::OperationalTime, youbot::IClippingParameterFirstParametersPositionControl, youbot::MotorPoles, youbot::DParameterFirstParametersPositionControl, youbot::MotorControllerTimeout, youbot::IParameterFirstParametersPositionControl, youbot::MotorCoilResistance, youbot::PParameterFirstParametersPositionControl, youbot::MaximumMotorCurrent, youbot::VelocityThresholdForHallFX, youbot::MassInertiaConstant, youbot::SpeedControlSwitchingThreshold, youbot::InitSineDelay, youbot::PositionControlSwitchingThreshold, youbot::InitializationMode, youbot::RampGeneratorSpeedAndPositionControl, youbot::I2tLimit, youbot::MotorAcceleration, youbot::I2tExceedCounter, youbot::MaximumPositioningVelocity, youbot::ActualModuleSupplyCurrent, youbot::HallSensorPolarityReversal, youbot::ActualMotorDriverTemperature, youbot::EncoderStopSwitch, youbot::I2tSum, youbot::EncoderResolution, youbot::RampGeneratorSpeed, youbot::CurrentErrorSum, youbot::CurrentControlLoopDelay, youbot::CurrentError, youbot::CommutationMotorCurrent, youbot::VelocityErrorSum, youbot::CommutationMode, youbot::VelocityError, youbot::BEMFConstant, youbot::PositionErrorSum, youbot::PositionError, youbot::ApproveProtectedParameters, youbot::InitializeJoint, youbot::ErrorAndStatus, youbot::ActualCommutationOffset, youbot::ActivateOvervoltageProtection, youbot::ActualMotorVoltage, youbot::YouBotJointParameter, and youbot::YouBotJointParameterPasswordProtected.

Friends And Related Function Documentation

friend class YouBotJoint
friend

Definition at line 71 of file YouBotJointParameterReadOnly.hpp.

Member Data Documentation

std::string youbot::YouBotJointParameterReadOnly::name
protected

Definition at line 91 of file YouBotJointParameterReadOnly.hpp.

ParameterType youbot::YouBotJointParameterReadOnly::parameterType
protected

Definition at line 93 of file YouBotJointParameterReadOnly.hpp.


The documentation for this class was generated from the following files:


youbot_driver
Author(s): Jan Paulus
autogenerated on Mon Jun 10 2019 15:46:27