#include <eband_local_planner/FollowBaseTrajectoryAction.h>
#include <actionlib/server/simple_action_server.h>
#include <geometry_msgs/Twist.h>
#include <tf/transform_listener.h>
#include <eband_local_planner/eband_local_planner_ros.h>
#include <boost/thread.hpp>
#include <boost/foreach.hpp>
#include <boost/format.hpp>
Go to the source code of this file.
Classes | |
class | eband_local_planner::Node |
struct | eband_local_planner::ScopedCostmapActivate |
Namespaces | |
namespace | eband_local_planner |
Typedefs | |
typedef FollowBaseTrajectoryGoalConstPtr | eband_local_planner::GoalPtr |
typedef boost::mutex::scoped_lock | eband_local_planner::Lock |
typedef FollowBaseTrajectoryResult | eband_local_planner::Result |
Functions | |
int | main (int argc, char **argv) |
Result | eband_local_planner::result (const string &msg) |
Result | eband_local_planner::result (const format &f) |
gm::Twist | eband_local_planner::zeroVelocity () |
Ros node that provides an implementation of the FollowBaseTrajectory action. Unlike the MoveBase action, this action allows passing in an entire trajectory which will be followed.
Definition in file eband_action.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 195 of file eband_action.cpp.