#include <ros/ros.h>
#include <geometry_msgs/Twist.h>
#include <predicate_manager/predicate_manager.h>
#include <predicate_manager/dependencies.h>
#include <predicate_manager/prop_logic_predicate.h>
#include <predicate_manager/prop_logic_event.h>
#include <predicate_manager/prop_and.h>
#include <predicate_manager/prop_pv.h>
#include <predicate_manager/prop_not.h>
#include <topological_tools/topological_predicate.h>
Go to the source code of this file.
Classes | |
class | IsMovingPredicate |
class | PatrolHalfwayThroughPred |
Functions | |
int | main (int argc, char **argv) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Predicate Instantiation (predicates used in the MDP's state layer)
Other example predicates:
An example of a predicate defined through a propositional formula:
An example of an event defined through a propositional formula: Triggers whenever the PatrolHalfwayThrough predicate falls (i.e. the patrol completes one round)
Registering predicates in the PM
Starting PM
Definition at line 79 of file demo_predicates.cpp.