#include "planner_modules_pr2/navstack_module_full_body.h"
#include "planner_modules_pr2/navstack_module.h"
#include "tidyup_utils/arm_state.h"
#include <ros/ros.h>
#include <nav_msgs/GetPlan.h>
#include <geometry_msgs/PoseStamped.h>
#include <topic_tools/MuxSelect.h>
#include <map>
#include <utility>
#include <boost/foreach.hpp>
#include <sys/times.h>
#include <tf/tf.h>
#include <tf/transform_listener.h>
Go to the source code of this file.
Defines | |
#define | forEach BOOST_FOREACH |
Functions | |
void | fullbody_navstack_init (int argc, char **argv) |
double | fullbody_pathCost (const ParameterList ¶meterList, predicateCallbackType predicateCallback, numericalFluentCallbackType numericalFluentCallback, int relaxed) |
void | jointStateCallback (const sensor_msgs::JointState &msg) |
void | publishPlanningArmState () |
void | switchToExecutionTopic () |
VERIFY_CONDITIONCHECKER_DEF (fullbody_pathCost) | |
Variables | |
bool | receivedJointState |
static sensor_msgs::JointState | s_CurrentState |
static ros::Subscriber | s_JointStateSubscriber |
static ros::Publisher | s_PlanningJointStatePublisher |
static ros::ServiceClient | s_SwitchJointTopicClient |
#define forEach BOOST_FOREACH |
Definition at line 16 of file navstack_module_full_body.cpp.
void fullbody_navstack_init | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 80 of file navstack_module_full_body.cpp.
double fullbody_pathCost | ( | const ParameterList & | parameterList, |
predicateCallbackType | predicateCallback, | ||
numericalFluentCallbackType | numericalFluentCallback, | ||
int | relaxed | ||
) |
Definition at line 104 of file navstack_module_full_body.cpp.
void jointStateCallback | ( | const sensor_msgs::JointState & | msg | ) |
Definition at line 30 of file navstack_module_full_body.cpp.
void publishPlanningArmState | ( | ) |
Definition at line 36 of file navstack_module_full_body.cpp.
void switchToExecutionTopic | ( | ) |
Definition at line 61 of file navstack_module_full_body.cpp.
Definition at line 28 of file navstack_module_full_body.cpp.
sensor_msgs::JointState s_CurrentState [static] |
Definition at line 27 of file navstack_module_full_body.cpp.
ros::Subscriber s_JointStateSubscriber [static] |
Definition at line 25 of file navstack_module_full_body.cpp.
Definition at line 26 of file navstack_module_full_body.cpp.
Definition at line 24 of file navstack_module_full_body.cpp.