| ►Cargparse.Action | |
| Cros2controlcli.api.ParserROSArgs | |
| Chardware_interface::ActuatorInfo | Contains semantic info about a given actuator loaded from URDF for a transmission |
| Cadmittance_controller::AdmittanceRule | |
| Cadmittance_controller::AdmittanceState | |
| Ccontrol_toolbox::AntiWindupStrategy | Antiwindup strategy for PID controllers |
| Chardware_interface::AsyncComponentThread | |
| Crealtime_tools::AsyncFunctionHandler< T > | 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 |
| Crealtime_tools::AsyncFunctionHandlerParams | The 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 |
| Crealtime_tools::AsyncSchedulingPolicy | Enum 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 |
| Ccontroller_manager.controller_manager_services.bcolors | |
| Cparallel_gripper_action_controller::GripperActionController::Commands | Store position and max effort in struct to allow easier realtime buffer usage |
| Chardware_interface::ComponentInfo | |
| Ccontroller_manager::ControllerChainSpec | |
| Chardware_interface::ControllerInfo | Controller Information |
| Ccontroller_interface::ControllerInterfaceParams | |
| Crqt_joint_trajectory_controller.utils.ControllerLister | |
| Crqt_joint_trajectory_controller.utils.ControllerManagerLister | Convenience classes for querying controller managers and controllers |
| Cros2controlcli.api.ControllerNameCompleter | |
| Ccontroller_manager::ControllerSpec | Controller Specification |
| Ccontroller_interface::ControllerUpdateStats | |
| Ccontroller_interface::ControllerUpdateStatus | |
| Ccontrol_toolbox::Dither | Gives white noise at specified amplitude |
| Crealtime_tools::detail::error_mutex_type_t | |
| ►CException | |
| Ccontroller_manager.controller_manager_services.ServiceNotFoundError | |
| ►Cstd::exception | |
| Ctransmission_interface::Exception | |
| Ctransmission_interface::TransmissionInterfaceException | |
| ►Cfilters::FilterBase | |
| Ccontrol_filters::ExponentialFilter< T > | A exponential filter class |
| Ccontrol_filters::GravityCompensation< T > | |
| Ccontrol_filters::LowPassFilter< T > | A Low-pass filter class |
| Ccontrol_filters::RateLimiter< T > | |
| Ccontrol_toolbox::FilterTraits< T > | |
| Ccontrol_toolbox::FilterTraits< geometry_msgs::msg::WrenchStamped > | |
| Ccontrol_toolbox::FilterTraits< std::vector< U > > | |
| Ccontrol_toolbox::FilterVector< U > | |
| CForceTorqueData | |
| Ccontrol_toolbox::Pid::Gains | Store gains in a struct to allow easier realtime box usage |
| Cgazebo_ros2_control::GazeboRosControlPrivate | |
| Cgz_ros2_control::GazeboSimROS2ControlPluginPrivate | |
| Cgz_ros2_control::GazeboSimSystemPrivate | |
| Cgazebo_ros2_control::GazeboSystemPrivate | |
| ►Chardware_interface::Handle | A handle used to get and set a value on a given interface |
| Chardware_interface::CommandInterface | |
| Chardware_interface::StateInterface | |
| ►Ctransmission_interface::Handle | |
| Ctransmission_interface::ActuatorHandle | |
| Ctransmission_interface::JointHandle | |
| Chardware_interface::HandleDataType | |
| Chardware_interface::HardwareAsyncParams | |
| Chardware_interface::HardwareComponent | |
| Chardware_interface::HardwareComponentCycleStatus | |
| Chardware_interface::HardwareComponentInfo | Hardware Component Information |
| Chardware_interface::HardwareComponentInterfaceParams | Parameters 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 |
| Chardware_interface::HardwareComponentParams | Parameters 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 |
| Chardware_interface::HardwareComponentStatisticsData | |
| Chardware_interface::HardwareInfo | This structure stores information about hardware defined in a robot's URDF |
| Chardware_interface::HardwareReadWriteStatus | |
| CImuData | |
| Ccontroller_interface::InterfaceConfiguration | Configuring what command/state interfaces to claim |
| Chardware_interface::InterfaceDescription | |
| Chardware_interface::InterfaceInfo | |
| ►Cgz::sim::ISystemConfigure | |
| Cgz_ros2_control::GazeboSimROS2ControlPlugin | |
| ►Cgz::sim::ISystemPostUpdate | |
| Cgz_ros2_control::GazeboSimROS2ControlPlugin | |
| ►Cgz::sim::ISystemPreUpdate | |
| Cgz_ros2_control::GazeboSimROS2ControlPlugin | |
| Cros2_control_demo_example_11::Joint | |
| Cjoint_limits::JointControlInterfacesData | |
| CjointData | |
| Chardware_interface::JointInfo | Contains semantic info about a given joint loaded from URDF for a transmission |
| Cjoint_limits::JointInterfacesCommandLimiterData | |
| ►Cjoint_limits::JointLimiterInterface< JointLimitsStateDataType > | |
| ►Cjoint_limits::JointSaturationLimiter< JointControlInterfacesData > | |
| Cjoint_limits::JointSoftLimiter | |
| Cjoint_limits::JointSaturationLimiter< JointLimitsStateDataType > | |
| Cjoint_limits::JointLimiterInterface< JointControlInterfacesData > | |
| Cjoint_limits::JointLimits | |
| Cjoint_state_broadcaster::JointStateBroadcaster::JointStateData | |
| Cros2_control_demo_example_11::JointValue | |
| ►Ckinematics_interface::KinematicsInterface | |
| Ckinematics_interface_kdl::KinematicsInterfaceKDL | |
| Ckinematics_interface_pinocchio::KinematicsInterfacePinocchio | |
| ►Crclcpp_lifecycle::node_interfaces::LifecycleNodeInterface | |
| ►Ccontroller_interface::ControllerInterfaceBase | |
| ►Ccontroller_interface::ChainableControllerInterface | |
| Cadmittance_controller::AdmittanceController | |
| Cchained_filter_controller::ChainedFilter | |
| Cdiff_drive_controller::DiffDriveController | |
| Cforce_torque_sensor_broadcaster::ForceTorqueSensorBroadcaster | |
| Cimu_sensor_broadcaster::IMUSensorBroadcaster | |
| Cmecanum_drive_controller::MecanumDriveController | |
| Comni_wheel_drive_controller::OmniWheelDriveController | |
| Cpassthrough_controller::PassthroughController | |
| Cpid_controller::PidController | |
| ►Csteering_controllers_library::SteeringControllersLibrary | |
| Cackermann_steering_controller::AckermannSteeringController | |
| Cbicycle_steering_controller::BicycleSteeringController | |
| Ctricycle_steering_controller::TricycleSteeringController | |
| ►Ccontroller_interface::ControllerInterface | |
| ►Cforward_command_controller::ForwardControllersBase | Forward command controller for a set of joints and interfaces |
| ►Cforward_command_controller::ForwardCommandController | Forward command controller for a set of joints |
| Ceffort_controllers::JointGroupEffortController | Forward command controller for a set of effort controlled joints (linear or angular) |
| Cposition_controllers::JointGroupPositionController | Forward command controller for a set of position controlled joints (linear or angular) |
| Cvelocity_controllers::JointGroupVelocityController | Forward command controller for a set of velocity controlled joints (linear or angular) |
| Cforward_command_controller::MultiInterfaceForwardCommandController | Multi interface forward command controller for a set of interfaces |
| Cgpio_controllers::GpioCommandController | |
| Cgps_sensor_broadcaster::GPSSensorBroadcaster | |
| Cjoint_state_broadcaster::JointStateBroadcaster | Joint State Broadcaster for all or some state in a ros2_control system |
| Cjoint_trajectory_controller::JointTrajectoryController | |
| ►Cmotion_primitives_controllers::MotionPrimitivesBaseController | |
| Cmotion_primitives_controllers::MotionPrimitivesForwardController | |
| Cparallel_gripper_action_controller::GripperActionController | Controller for executing a ParallelGripperCommand action |
| Cpose_broadcaster::PoseBroadcaster | |
| Crange_sensor_broadcaster::RangeSensorBroadcaster | |
| Cros2_control_demo_example_7::RobotController | |
| Ctricycle_controller::TricycleController | |
| ►Chardware_interface::HardwareComponentInterface | Virtual base class for all hardware components (Actuators, Sensors, and Systems) |
| ►Chardware_interface::ActuatorInterface | Virtual Class to implement when integrating a 1 DoF actuator into ros2_control |
| Cros2_control_demo_example_14::RRBotActuatorWithoutFeedback | |
| Cros2_control_demo_example_6::RRBotModularJoint | |
| ►Chardware_interface::SensorInterface | Virtual Class to implement when integrating a stand-alone sensor into ros2_control |
| Cros2_control_demo_example_14::RRBotSensorPositionFeedback | |
| Cros2_control_demo_example_5::ExternalRRBotForceTorqueSensorHardware | |
| ►Chardware_interface::SystemInterface | Virtual Class to implement when integrating a complex system into ros2_control |
| Ccm_topic_hardware_component::CMTopicSystem | |
| ►Cgazebo_ros2_control::GazeboSystemInterface | |
| Cgazebo_ros2_control::GazeboSystem | |
| ►Cgz_ros2_control::GazeboSimSystemInterface | |
| Cgz_ros2_control::GazeboSimSystem | |
| Cjoint_state_topic_hardware_interface::JointStateTopicSystem | |
| Cmock_components::GenericSystem | |
| Cros2_control_demo_example_10::RRBotSystemWithGPIOHardware | |
| Cros2_control_demo_example_11::CarlikeBotSystemHardware | |
| Cros2_control_demo_example_12::RRBotSystemPositionOnlyHardware | |
| Cros2_control_demo_example_16::DiffBotSystemHardware | |
| Cros2_control_demo_example_17::RRBotSystemPositionOnlyHardware | |
| Cros2_control_demo_example_1::RRBotSystemPositionOnlyHardware | |
| Cros2_control_demo_example_2::DiffBotSystemHardware | |
| Cros2_control_demo_example_3::RRBotSystemMultiInterfaceHardware | |
| Cros2_control_demo_example_4::RRBotSystemWithSensorHardware | |
| Cros2_control_demo_example_5::RRBotSystemPositionOnlyHardware | |
| Cros2_control_demo_example_7::RobotSystem | |
| Cros2_control_demo_example_8::RRBotTransmissionsSystemPositionOnlyHardware | |
| Cros2_control_demo_example_9::RRBotSystemPositionOnlyHardware | |
| Ccontrol_toolbox::LimitedProxy | |
| Cros2controlcli.api.LoadedControllerNameCompleter | |
| Cros2controlcli.api.LoadedHardwareComponentNameCompleter | |
| Chardware_interface::LoanedCommandInterface | |
| Chardware_interface::LoanedStateInterface | |
| Crealtime_tools::LockFreeQueueBase< DataType, LockFreeContainer > | A base class for lock-free queues |
| Ccontrol_toolbox::LowPassFilter< T > | A Low-pass filter class |
| Chardware_interface::MimicJoint | This structure stores information about a joint that is mimicking another joint |
| CMimicJoint | |
| ►Cgazebo::ModelPlugin | |
| Cgazebo_ros2_control::GazeboRosControlPlugin | |
| Cros2_control::MovingAverageStatistics | |
| Cros2_control::MovingAverageStatisticsData | Data structure to store the statistics of a moving average. The data is protected by a mutex and the data can be updated and retrieved |
| Crealtime_tools::detail::mutex< MutexType, MutexRobustness > | A class template that provides a pthread mutex with the priority inheritance protocol |
| ►Crclcpp::Node | |
| Ccontroller_manager::ControllerManager | |
| Cforce_torque_sensor_broadcaster::WrenchTransformer | |
| Cdiff_drive_controller::Odometry | |
| Cmecanum_drive_controller::Odometry | Handles odometry readings (2D pose and velocity with related timestamp) |
| Comni_wheel_drive_controller::Odometry | |
| Ctricycle_controller::Odometry | |
| Ccontrol_toolbox::Pid | Generic Proportional–Integral–Derivative (PID) controller |
| Ccontrol_toolbox::PidROS | |
| Ccontrol_toolbox::RateLimiter< T > | |
| Ccontrol_toolbox::RateLimiter< double > | |
| Crealtime_tools::RealtimeBuffer< T > | |
| Crealtime_tools::RealtimeBuffer< joint_trajectory_controller::SegmentTolerances > | |
| Crealtime_tools::RealtimeBuffer< RealtimeGoalHandlePtr > | |
| Crealtime_tools::RealtimeBuffer< std::shared_ptr< trajectory_msgs::msg::JointTrajectory > > | |
| Crealtime_tools::RealtimeBuffer< std::vector< joint_limits::JointLimits > > | |
| Crealtime_tools::RealtimePublisher< MessageT > | |
| Crealtime_tools::RealtimeServerGoalHandle< Action > | |
| Crealtime_tools::RealtimeThreadSafeBox< T, mutex_type > | |
| Crealtime_tools::RealtimeThreadSafeBox< CmdType > | |
| Crealtime_tools::RealtimeThreadSafeBox< control_toolbox::Pid::Gains > | |
| Crealtime_tools::RealtimeThreadSafeBox< ControllerMeasuredStateMsg > | |
| Crealtime_tools::RealtimeThreadSafeBox< ControllerReferenceMsg > | |
| Crealtime_tools::RealtimeThreadSafeBox< ControllerTwistReferenceMsg > | |
| Crealtime_tools::RealtimeThreadSafeBox< DataType > | |
| Crealtime_tools::RealtimeThreadSafeBox< geometry_msgs::msg::WrenchStamped > | |
| Crealtime_tools::RealtimeThreadSafeBox< parallel_gripper_action_controller::GripperActionController::Commands > | |
| Crealtime_tools::RealtimeThreadSafeBox< rclcpp::Time > | |
| Crealtime_tools::RealtimeThreadSafeBox< RealtimeGoalHandlePtr > | |
| Crealtime_tools::RealtimeThreadSafeBox< std::optional< control_msgs::msg::HardwareStatus > > | |
| Crealtime_tools::RealtimeThreadSafeBox< std::shared_ptr< realtime_tools::RealtimeServerGoalHandle > > | |
| Crealtime_tools::RealtimeThreadSafeBox< std::shared_ptr< TwistStamped > > | |
| Crealtime_tools::RealtimeThreadSafeBox< trajectory_msgs::msg::JointTrajectory > | |
| Crealtime_tools::RealtimeThreadSafeBox< trajectory_msgs::msg::JointTrajectoryPoint > | |
| Crealtime_tools::RealtimeThreadSafeBox< TwistStamped > | |
| Crealtime_tools::detail::recursive_mutex_type_t | |
| ►Chardware_interface::ResourceManager | |
| Cgz_ros2_control::GZResourceManager | |
| Chardware_interface::ResourceManagerParams | Parameters required for the construction and initial setup of a ResourceManager. This struct is typically populated by the ControllerManager |
| Chardware_interface::ResourceStorage | |
| Crealtime_tools::detail::robust_robustness_t | |
| Cgazebo_ros2_control::SafeEnum< ENUM, UNDERLYING > | |
| Cgz_ros2_control::SafeEnum< ENUM, UNDERLYING > | This class allows us to handle flags easily, instead of using strings |
| Cjoint_trajectory_controller::SegmentTolerances | Trajectory segment tolerances |
| Csemantic_components::SemanticComponentCommandInterface< MessageInputType > | |
| ►Csemantic_components::SemanticComponentCommandInterface< std_msgs::msg::ColorRGBA > | |
| Csemantic_components::LedRgbDevice | |
| Csemantic_components::SemanticComponentInterface< MessageReturnType > | |
| ►Csemantic_components::SemanticComponentInterface< geometry_msgs::msg::Pose > | |
| Csemantic_components::PoseSensor | |
| ►Csemantic_components::SemanticComponentInterface< geometry_msgs::msg::Wrench > | |
| Csemantic_components::ForceTorqueSensor | |
| ►Csemantic_components::SemanticComponentInterface< sensor_msgs::msg::Imu > | |
| Csemantic_components::IMUSensor | |
| ►Csemantic_components::SemanticComponentInterface< sensor_msgs::msg::MagneticField > | |
| Csemantic_components::MagneticFieldSensor | |
| ►Csemantic_components::SemanticComponentInterface< sensor_msgs::msg::NavSatFix > | |
| Csemantic_components::GPSSensor< sensor_option > | |
| ►Csemantic_components::SemanticComponentInterface< sensor_msgs::msg::Range > | |
| Csemantic_components::RangeSensor | |
| Ccontrol_toolbox::SineSweep | Generates a sine sweep for frequency analysis of a joint |
| Ccontroller_manager.controller_manager_services.SingletonServiceCaller | |
| Ccontrol_toolbox::Sinusoid | A basic sine class |
| Cjoint_limits::SoftJointLimits | |
| Cdiff_drive_controller::SpeedLimiter | |
| Crealtime_tools::detail::stalled_robustness_t | |
| Cjoint_trajectory_controller::StateTolerances | Trajectory state tolerances for position, velocity and acceleration variables |
| Ctricycle_controller::TricycleController::SteeringHandle | |
| Csteering_kinematics::SteeringKinematics | Handles forward kinematics (odometry calculations) and inverse kinematics (getting commands) (2D pose and velocity with related timestamp) |
| Ctricycle_controller::SteeringLimiter | |
| Csteering_odometry::SteeringOdometry | Deprecated Odometry class for backward ABI compatibility. Internally calling steering_kinematics::SteeringKinematics |
| ►Cgz::sim::System | |
| Cgz_ros2_control::GazeboSimROS2ControlPlugin | |
| ►Cunittest.TestCase | |
| Ceffort_test.TestFixture | |
| Cft_sensor_test.TestFixture | |
| Cposition_test.TestFixture | |
| Cvelocity_test.TestFixture | |
| Ctricycle_controller::TricycleController::TractionHandle | |
| Ctricycle_controller::TractionLimiter | |
| Cjoint_trajectory_controller::Trajectory | |
| ►Ctransmission_interface::Transmission | Abstract base class for representing mechanical transmissions |
| Ctransmission_interface::DifferentialTransmission | |
| Ctransmission_interface::FourBarLinkageTransmission | Implementation of a four-bar-linkage transmission |
| Ctransmission_interface::SimpleTransmission | |
| Chardware_interface::TransmissionInfo | Contains semantic info about a given transmission loaded from URDF |
| ►Ctransmission_interface::TransmissionLoader | Abstract interface for loading transmission instances from configuration data |
| Ctransmission_interface::DifferentialTransmissionLoader | Class for loading a four-bar linkage transmission instance from configuration data |
| Ctransmission_interface::FourBarLinkageTransmissionLoader | Class for loading a four-bar linkage transmission instance from configuration data |
| Ctransmission_interface::SimpleTransmissionLoader | Class for loading a simple transmission instance from configuration data |
| Cdiff_drive_controller::DiffDriveController::WheelHandle | |
| Comni_wheel_drive_controller::OmniWheelDriveController::WheelHandle | |
| ►CCommandExtension | |
| Cros2controlcli.command.control.ControlCommand | |
| ►CNode | |
| Cros2_controllers_test_nodes.publisher_forward_position_controller.PublisherForwardPosition | |
| Cros2_controllers_test_nodes.publisher_joint_trajectory_controller.PublisherJointTrajectory | |
| ►CPlugin | |
| Crqt_controller_manager.controller_manager.ControllerManager | |
| Crqt_joint_trajectory_controller.joint_trajectory_controller.JointTrajectoryController | |
| ►CQAbstractTableModel | |
| Crqt_controller_manager.controller_manager.ControllerTable | |
| Crqt_controller_manager.controller_manager.HwComponentTable | |
| ►CQStyledItemDelegate | |
| Crqt_controller_manager.controller_manager.FontDelegate | |
| ►CQWidget | |
| Crqt_joint_trajectory_controller.double_editor.DoubleEditor | |
| ►CVerbExtension | |
| Cros2controlcli.verb.list_controller_types.ListControllerTypesVerb | |
| Cros2controlcli.verb.list_controllers.ListControllersVerb | |
| Cros2controlcli.verb.list_hardware_components.ListHardwareComponentsVerb | |
| Cros2controlcli.verb.list_hardware_interfaces.ListHardwareInterfacesVerb | |
| Cros2controlcli.verb.load_controller.LoadControllerVerb | |
| Cros2controlcli.verb.reload_controller_libraries.ReloadControllerLibrariesVerb | |
| Cros2controlcli.verb.set_controller_state.SetControllerStateVerb | |
| Cros2controlcli.verb.set_hardware_component_state.SetHardwareComponentStateVerb | |
| Cros2controlcli.verb.switch_controllers.SwitchControllersVerb | |
| Cros2controlcli.verb.unload_controller.UnloadControllerVerb | |
| Cros2controlcli.verb.view_controller_chains.ViewControllerChainsVerb | |