|
C++ YASMIN (Yet Another State MachINe)
|
| Cyasmin::blackboard::Blackboard | A thread-safe storage for key-value pairs of varying types |
| Cyasmin::blackboard::BlackboardPyWrapper | A wrapper around the C++ Blackboard that stores Python objects and native types |
| ▼Cyasmin::blackboard::BlackboardValueInterface | Interface for blackboard value types |
| Cyasmin::blackboard::BlackboardValue< T > | A template class that wraps a value of type T |
| ▼Crclcpp::Node | |
| CAuxNode | |
| CAuxNode | |
| CAuxNode | |
| CFibonacciActionServer | A ROS 2 action server node for calculating Fibonacci sequences |
| CServerNode | A ROS 2 service server node for adding two integers |
| Cyasmin_ros::YasminNode | A ROS 2 node for managing and handling YASMIN-based applications |
| Cyasmin_ros::ROSClientsCache | Centralized cache for managing ROS 2 client objects |
| ▼CState | |
| CBarState | Represents the "Bar" state in the state machine |
| CBarState | Represents the "Bar" state in the state machine |
| CBarState | Represents the "Bar" state in the state machine |
| CFooState | Represents the "Foo" state in the state machine |
| CFooState | Represents the "Foo" state in the state machine |
| CFooState | Represents the "Foo" state in the state machine |
| ▼Cyasmin::State | Represents a state in a state machine |
| ▼Cyasmin_ros::ActionState< Fibonacci > | |
| CFibonacciState | Represents the action state for the Fibonacci action |
| ▼Cyasmin_ros::MonitorState< nav_msgs::msg::Odometry > | |
| CPrintOdometryState | A state that monitors odometry data and transitions based on a specified count |
| ▼Cyasmin_ros::PublisherState< std_msgs::msg::Int32 > | |
| CPublishIntState | A state that publishes ints |
| ▼Cyasmin_ros::ServiceState< example_interfaces::srv::AddTwoInts > | |
| CAddTwoIntsState | State for calling the AddTwoInts service in ROS 2 |
| CBarState | Represents the "Bar" state in the state machine |
| CBarState | Represents the "Bar" state in the state machine |
| CBarState | Represents the "Bar" state in the state machine |
| CBarState | Represents the "Bar" state in the state machine |
| CFooState | Represents the "Foo" state in the state machine |
| CFooState | Represents the "Foo" state in the state machine |
| CFooState | Represents the "Foo" state in the state machine |
| CFooState | Represents the "Foo" state in the state machine |
| Cyasmin::CbState | Represents a state that executes a callback function |
| Cyasmin::Concurrence | Runs a series of states in parallel |
| Cyasmin::PyState | Trampoline class to enable Python classes to inherit from C++ State |
| Cyasmin::StateMachine | A class that implements a state machine with a set of states, transitions, and callback mechanisms for state changes |
| Cyasmin_ros::ActionState< ActionT > | A state class for handling ROS 2 action client operations |
| Cyasmin_ros::GetParametersState | State that retrieves parameters from the ROS 2 parameter server |
| Cyasmin_ros::MonitorState< MsgT > | Template class to monitor a ROS 2 topic and process incoming messages |
| Cyasmin_ros::PublisherState< MsgT > | Template class to publish ROS 2 messages |
| Cyasmin_ros::ServiceState< ServiceT > | A state class that interacts with a ROS 2 service |
| ▼Ctesting::Test | |
| CTestActionClientState | |
| CTestBlackboard | |
| CTestCbState | |
| CTestConcurrence | |
| CTestMonitorState | |
| CTestPublisherState | |
| CTestServiceClientState | |
| CTestState | |
| CTestStateMachine | |
| Cyasmin_viewer::YasminViewerPub | Publishes state machine data for visualization |