#include <stdio.h>
#include <ros/ros.h>
#include <vector>
#include <deque>
#include <string>
#include <sstream>
#include <signal.h>
#include "continual_planning_executive/symbolicState.h"
#include "continual_planning_executive/stateCreator.h"
#include "continual_planning_executive/goalCreator.h"
#include "continual_planning_executive/plannerInterface.h"
#include "continual_planning_executive/SetContinualPlanningControl.h"
#include "continual_planning_executive/ExecuteActionDirectly.h"
#include "planExecutor.h"
#include "continualPlanning.h"
#include <pluginlib/class_loader.h>
Go to the source code of this file.
bool loadActionExecutors | ( | ros::NodeHandle & | nh | ) |
bool loadGoalCreators | ( | ros::NodeHandle & | nh | ) |
bool loadPlanner | ( | ros::NodeHandle & | nh | ) |
bool loadStateCreators | ( | ros::NodeHandle & | nh | ) |
bool parseOptions | ( | int | argc, |
char ** | argv, | ||
DurativeAction & | a | ||
) |
Parse options for this node:
If an action is given only this action is executed for debugging, e.g.: drive-base robot_location door_kitchen_room1 arm-to-side left_arm
void signal_handler | ( | int | signal | ) |
std::deque<std::string> splitString | ( | const std::string & | s, |
const char * | delim | ||
) |
ContinualPlanning* s_ContinualPlanning = NULL [static] |