►Nackermann_steering_controller | |
CAckermannSteeringController | |
►Nadmittance_controller | |
CAdmittanceController | |
CAdmittanceRule | |
CAdmittanceState | |
CAdmittanceTransforms | |
►Nbicycle_steering_controller | |
CBicycleSteeringController | |
►Ncontrol_filters | |
CExponentialFilter | A exponential filter class |
CLowPassFilter | A Low-pass filter class |
CRateLimiter | |
►Ncontrol_toolbox | |
CDither | Gives white noise at specified amplitude |
CLimitedProxy | |
CLowPassFilter | A Low-pass filter class |
►CPid | A basic pid class |
CGains | Store gains in a struct to allow easier realtime buffer usage |
CPidROS | |
CRateLimiter | |
CSineSweep | Generates a sine sweep for frequency analysis of a joint |
CSinusoid | A basic sine class |
►Ncontroller_interface | |
CChainableControllerInterface | |
CControllerInterface | |
CControllerInterfaceBase | |
CInterfaceConfiguration | Configuring what command/state interfaces to claim |
►Ncontroller_manager | |
►Ncontroller_manager_services | |
Cbcolors | |
CServiceNotFoundError | |
CSingletonServiceCaller | |
CControllerManager | |
CControllerSpec | Controller Specification |
►Ndiff_drive_controller | |
►CDiffDriveController | |
CWheelHandle | |
COdometry | |
CSpeedLimiter | |
►Neffort_controllers | |
CJointGroupEffortController | Forward command controller for a set of effort controlled joints (linear or angular) |
►Neffort_test | |
CTestFixture | |
►Nforce_torque_sensor_broadcaster | |
CForceTorqueSensorBroadcaster | |
►Nforward_command_controller | |
CForwardCommandController | Forward command controller for a set of joints |
CForwardControllersBase | Forward command controller for a set of joints and interfaces |
CMultiInterfaceForwardCommandController | Multi interface forward command controller for a set of interfaces |
►Ngazebo_ros2_control | |
CGazeboRosControlPlugin | |
CGazeboRosControlPrivate | |
CGazeboSystem | |
CGazeboSystemInterface | |
CGazeboSystemPrivate | |
CSafeEnum | |
►Ngpio_controllers | |
CGpioCommandController | |
►Ngripper_action_controller | |
►CGripperActionController | Controller for executing a gripper command action for simple single-dof grippers |
CCommands | Store position and max effort in struct to allow easier realtime buffer usage |
►Ngz_ros2_control | |
CGazeboSimROS2ControlPlugin | |
CGazeboSimROS2ControlPluginPrivate | |
CGazeboSimSystem | |
CGazeboSimSystemInterface | |
CGazeboSimSystemPrivate | |
CSafeEnum | This class allows us to handle flags easily, instead of using strings |
►Nhardware_interface | |
CActuator | |
CActuatorInfo | Contains semantic info about a given actuator loaded from URDF for a transmission |
CActuatorInterface | Virtual Class to implement when integrating a 1 DoF actuator into ros2_control |
CCommandInterface | |
CComponentInfo | |
CControllerInfo | Controller Information |
CHardwareComponentInfo | Hardware Component Information |
CHardwareInfo | This structure stores information about hardware defined in a robot's URDF |
CHardwareReadWriteStatus | |
CInterfaceInfo | |
CJointInfo | Contains semantic info about a given joint loaded from URDF for a transmission |
CLoanedCommandInterface | |
CLoanedStateInterface | |
CReadOnlyHandle | A handle used to get and set a value on a given interface |
CReadWriteHandle | |
CResourceManager | |
CResourceStorage | |
CSensor | |
CSensorInterface | Virtual Class to implement when integrating a stand-alone sensor into ros2_control |
CStateInterface | |
CSystem | |
CSystemInterface | Virtual Class to implement when integrating a complex system into ros2_control |
CTransmissionInfo | Contains semantic info about a given transmission loaded from URDF |
►Nimu_sensor_broadcaster | |
CIMUSensorBroadcaster | |
►Njoint_limits | |
CJointLimits | |
CSoftJointLimits | |
►Njoint_limits_interface | |
CEffortJointSaturationHandle | |
CEffortJointSoftLimitsHandle | A handle used to enforce position, velocity and effort limits of an effort-controlled joint |
CJointLimitHandle | |
CJointLimitsInterfaceException | An exception related to a JointLimitsInterface |
CJointSoftLimitsHandle | |
CPositionJointSaturationHandle | |
CPositionJointSoftLimitsHandle | A handle used to enforce position and velocity limits of a position-controlled joint |
CVelocityJointSaturationHandle | A handle used to enforce velocity and acceleration limits of a velocity-controlled joint |
CVelocityJointSoftLimitsHandle | |
►Njoint_state_broadcaster | |
CJointStateBroadcaster | Joint State Broadcaster for all or some state in a ros2_control system |
►Njoint_trajectory_controller | |
CJointTrajectoryController | |
CSegmentTolerances | Trajectory segment tolerances |
CStateTolerances | Trajectory state tolerances for position, velocity and acceleration variables |
CTrajectory | |
►Nkinematics_interface | |
CKinematicsInterface | |
►Nkinematics_interface_kdl | |
CKinematicsInterfaceKDL | |
►Nmecanum_drive_controller | |
CMecanumDriveController | |
COdometry | Handles odometry readings (2D pose and velocity with related timestamp) |
►Nmock_components | |
►CGenericSystem | |
CMimicJoint | |
►Npassthrough_controller | |
CPassthroughController | |
►Npid_controller | |
CPidController | |
►Npose_broadcaster | |
CPoseBroadcaster | |
►Nposition_controllers | |
CJointGroupPositionController | Forward command controller for a set of position controlled joints (linear or angular) |
►Nposition_test | |
CTestFixture | |
►Nposition_test_backward_compatibility | |
CTestFixture | |
►Nrange_sensor_broadcaster | |
CRangeSensorBroadcaster | |
►Nrealtime_tools | A 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 |
►Ndetail | |
Cerror_mutex_type_t | |
Cmutex | A class template that provides a pthread mutex with the priority inheritance protocol |
Crecursive_mutex_type_t | |
Crobust_robustness_t | |
Cstalled_robustness_t | |
CAsyncFunctionHandler | Class 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 |
CLockFreeQueueBase | A base class for lock-free queues |
CRealtimeBox | |
CRealtimeBoxBestEffort | |
CRealtimeBuffer | |
CRealtimeClock | |
CRealtimePublisher | |
CRealtimeServerGoalHandle | |
►Nros2_control_demo_example_1 | |
CRRBotSystemPositionOnlyHardware | |
►Nros2_control_demo_example_10 | |
CRRBotSystemWithGPIOHardware | |
►Nros2_control_demo_example_11 | |
CCarlikeBotSystemHardware | |
CJoint | |
CJointValue | |
►Nros2_control_demo_example_12 | |
CRRBotSystemPositionOnlyHardware | |
►Nros2_control_demo_example_14 | |
CRRBotActuatorWithoutFeedback | |
CRRBotSensorPositionFeedback | |
►Nros2_control_demo_example_2 | |
CDiffBotSystemHardware | |
►Nros2_control_demo_example_3 | |
CRRBotSystemMultiInterfaceHardware | |
►Nros2_control_demo_example_4 | |
CRRBotSystemWithSensorHardware | |
►Nros2_control_demo_example_5 | |
CExternalRRBotForceTorqueSensorHardware | |
CRRBotSystemPositionOnlyHardware | |
►Nros2_control_demo_example_6 | |
CRRBotModularJoint | |
►Nros2_control_demo_example_7 | |
CRobotController | |
CRobotSystem | |
►Nros2_control_demo_example_8 | |
CRRBotTransmissionsSystemPositionOnlyHardware | |
►Nros2_control_demo_example_9 | |
CRRBotSystemPositionOnlyHardware | |
►Nros2_controllers_test_nodes | |
►Npublisher_forward_position_controller | |
CPublisherForwardPosition | |
►Npublisher_joint_trajectory_controller | |
CPublisherJointTrajectory | |
►Nros2controlcli | |
►Napi | |
CControllerNameCompleter | |
CLoadedControllerNameCompleter | |
CLoadedHardwareComponentNameCompleter | |
►Ncommand | |
►Ncontrol | |
CControlCommand | |
►Nverb | |
►Nlist_controller_types | |
CListControllerTypesVerb | |
►Nlist_controllers | |
CListControllersVerb | |
►Nlist_hardware_components | |
CListHardwareComponentsVerb | |
►Nlist_hardware_interfaces | |
CListHardwareInterfacesVerb | |
►Nload_controller | |
CLoadControllerVerb | |
►Nreload_controller_libraries | |
CReloadControllerLibrariesVerb | |
►Nset_controller_state | |
CSetControllerStateVerb | |
►Nset_hardware_component_state | |
CSetHardwareComponentStateVerb | |
►Nswitch_controllers | |
CSwitchControllersVerb | |
►Nunload_controller | |
CUnloadControllerVerb | |
►Nview_controller_chains | |
CViewControllerChainsVerb | |
►Nrqt_controller_manager | |
►Ncontroller_manager | |
CControllerManager | |
CControllerTable | |
CFontDelegate | |
CHwComponentTable | |
►Nrqt_joint_trajectory_controller | |
►Ndouble_editor | |
CDoubleEditor | |
►Njoint_trajectory_controller | |
CJointTrajectoryController | |
►Nutils | |
CControllerLister | |
CControllerManagerLister | Convenience classes for querying controller managers and controllers |
►Nsemantic_components | |
CForceTorqueSensor | |
CIMUSensor | |
CPoseSensor | |
CRangeSensor | |
CSemanticComponentInterface | |
►Nsteering_controllers_library | |
CSteeringControllersLibrary | |
►Nsteering_odometry | |
CSteeringOdometry | The Odometry class handles odometry readings (2D pose and velocity with related timestamp) |
►Ntransmission_interface | |
CActuatorHandle | |
CDifferentialTransmission | Implementation of a differential transmission |
CDifferentialTransmissionLoader | Class for loading a four-bar linkage transmission instance from configuration data |
CException | |
CFourBarLinkageTransmission | Implementation of a four-bar-linkage transmission |
CFourBarLinkageTransmissionLoader | Class for loading a four-bar linkage transmission instance from configuration data |
CJointHandle | |
CSimpleTransmission | Implementation of a simple reducer transmission |
CSimpleTransmissionLoader | Class for loading a simple transmission instance from configuration data |
CTransmission | Abstract base class for representing mechanical transmissions |
CTransmissionInterfaceException | |
CTransmissionLoader | Abstract interface for loading transmission instances from configuration data |
►Ntricycle_controller | |
COdometry | |
CSteeringLimiter | |
CTractionLimiter | |
►CTricycleController | |
COdometryParams | |
CSteeringHandle | |
CTractionHandle | |
CWheelParams | |
►Ntricycle_steering_controller | |
CTricycleSteeringController | |
►Nvelocity_controllers | |
CJointGroupVelocityController | Forward command controller for a set of velocity controlled joints (linear or angular) |
►Nvelocity_test | |
CTestFixture | |
CHardwareInterfaceAdapter | Helper class to simplify integrating the GripperActionController with different hardware interfaces |
CHardwareInterfaceAdapter< hardware_interface::HW_IF_EFFORT > | Adapter for an effort-controlled hardware interface. Maps position and velocity errors to effort commands through a position PID loop |
CHardwareInterfaceAdapter< hardware_interface::HW_IF_POSITION > | Adapter for a position-controlled hardware interface. Forwards desired positions as commands |
CImuData | |
CjointData | |
CMimicJoint | |