ros2_control - rolling
Loading...
Searching...
No Matches
Namespace List
Here is a list of all documented namespaces with brief descriptions:
[detail level 123]
 Nadmittance_controller
 CAdmittanceController
 CAdmittanceRule
 CAdmittanceState
 Ncontrol_toolbox
 CAntiWindupStrategyAntiwindup strategy for PID controllers
 CDitherGives white noise at specified amplitude
 CExponentialFilter
 CFilterTraits
 CFilterTraits< geometry_msgs::msg::WrenchStamped >
 CFilterTraits< std::vector< U > >
 CFilterVector
 CLimitedProxy
 CLowPassFilterA Low-pass filter class
 CPidGeneric Proportional–Integral–Derivative (PID) controller
 CGainsStore gains in a struct to allow easier realtime box usage
 CPidROS
 CRateLimiter
 CSineSweepGenerates a sine sweep for frequency analysis of a joint
 CSinusoidA basic sine class
 Nhardware_interface
 CActuatorInfoContains semantic info about a given actuator loaded from URDF for a transmission
 CActuatorInterfaceVirtual Class to implement when integrating a 1 DoF actuator into ros2_control
 CCommandInterface
 CComponentInfo
 CControllerInfoController Information
 CHandleA handle used to get and set a value on a given interface
 CHandleDataType
 CHardwareAsyncParams
 CHardwareComponent
 CHardwareComponentCycleStatus
 CHardwareComponentInfoHardware Component Information
 CHardwareComponentInterfaceVirtual base class for all hardware components (Actuators, Sensors, and Systems)
 CHardwareComponentInterfaceParamsParameters required for the initialization of a specific hardware component plugin. Typically used for on_init methods of hardware interfaces, and is parsed by the user. This struct is typically populated with data from HardwareComponentParams from each component
 CHardwareComponentParamsParameters required for the initialization of a specific hardware component plugin. Typically used for init, initialise and load methods of hardware components. This struct is typically not accessible to user. This struct is typically populated with data from ResourceManagerParams
 CHardwareComponentStatisticsData
 CHardwareInfoThis structure stores information about hardware defined in a robot's URDF
 CHardwareReadWriteStatus
 CInterfaceDescription
 CInterfaceInfo
 CJointInfoContains semantic info about a given joint loaded from URDF for a transmission
 CLoanedCommandInterface
 CLoanedStateInterface
 CMimicJointThis structure stores information about a joint that is mimicking another joint
 CResourceManager
 CResourceManagerParamsParameters required for the construction and initial setup of a ResourceManager. This struct is typically populated by the ControllerManager
 CResourceStorage
 CSensorInterfaceVirtual Class to implement when integrating a stand-alone sensor into ros2_control
 CStateInterface
 CSystemInterfaceVirtual Class to implement when integrating a complex system into ros2_control
 CTransmissionInfoContains semantic info about a given transmission loaded from URDF
 Njoint_limits
 CJointControlInterfacesData
 CJointInterfacesCommandLimiterData
 CJointLimiterInterface
 CJointLimits
 CJointSaturationLimiter
 CJointSoftLimiter
 CSoftJointLimits
 Njoint_trajectory_controller
 CJointTrajectoryController
 CSegmentTolerancesTrajectory segment tolerances
 CStateTolerancesTrajectory state tolerances for position, velocity and acceleration variables
 CTrajectory
 Nkinematics_interface
 CKinematicsInterface
 Nkinematics_interface_kdl
 CKinematicsInterfaceKDL
 Nkinematics_interface_pinocchio
 CKinematicsInterfacePinocchio
 Npal_statistics
 Nparallel_gripper_action_controller
 CGripperActionControllerController for executing a ParallelGripperCommand action
 CCommandsStore position and max effort in struct to allow easier realtime buffer usage
 Npassthrough_controller
 CPassthroughController
 Nrealtime_toolsA pthread mutex wrapper that provides a mutex with the priority inheritance protocol and a priority ceiling of 99. The mutex is also error checked and robust. This mutex is intended to be used in real-time contexts
 CAsyncFunctionHandlerClass to handle asynchronous function calls. AsyncFunctionHandler is a class that allows the user to have a asynchronous call to the parsed method and be able to set some thread specific parameters
 CAsyncFunctionHandlerParamsThe AsyncFunctionHandlerParams struct is used to configure the AsyncFunctionHandler. If the type is SYNCHRONIZED, the async worker thread will be synchronized with the main thread, as the main thread will be triggering the async callback method. If the type is DETACHED, the async worker thread will be detached from the main thread and will have its own execution cycle
 CAsyncSchedulingPolicyEnum class to define the scheduling policy for the async worker thread. SYNCHRONIZED: The async worker thread will be synchronized with the main thread, as the main thread will be triggering the async callback method. DETACHED: The async worker thread will be detached from the main thread and will have its own execution cycle. UNKNOWN: The scheduling policy is unknown
 CLockFreeQueueBaseA base class for lock-free queues
 CRealtimeBuffer
 CRealtimePublisher
 CRealtimeServerGoalHandle
 CRealtimeThreadSafeBox
 Ntest_constants
 Ntransmission_interface
 CActuatorHandle
 CDifferentialTransmission
 CDifferentialTransmissionLoaderClass for loading a four-bar linkage transmission instance from configuration data
 CException
 CFourBarLinkageTransmissionImplementation of a four-bar-linkage transmission
 CFourBarLinkageTransmissionLoaderClass for loading a four-bar linkage transmission instance from configuration data
 CHandle
 CJointHandle
 CSimpleTransmission
 CSimpleTransmissionLoaderClass for loading a simple transmission instance from configuration data
 CTransmissionAbstract base class for representing mechanical transmissions
 CTransmissionInterfaceException
 CTransmissionLoaderAbstract interface for loading transmission instances from configuration data