#include "cart_local_planner/cart_local_planner.h"
#include <base_local_planner/goal_functions.h>
#include <ros/ros.h>
#include <tf/transform_listener.h>
#include <tf/transform_datatypes.h>
#include <nav_msgs/Odometry.h>
#include <string>
#include <vector>
#include <ostream>
#include "ros/serialization.h"
#include "ros/builtin_message_traits.h"
#include "ros/message_operations.h"
#include "ros/message.h"
#include "ros/time.h"
#include "std_msgs/Header.h"
#include "geometry_msgs/PoseStamped.h"
#include <geometry_msgs/Twist.h>
#include <geometry_msgs/Point.h>
#include <cmath>
#include <algorithm>
#include <stdio.h>
#include <costmap_2d/costmap_2d.h>
#include <costmap_2d/costmap_2d_ros.h>
#include "kdl/frames.hpp"
#include "geometry_msgs/Pose.h"
#include "Poco/Foundation.h"
#include <stdexcept>
#include "Poco/Exception.h"
#include <pthread.h>
#include <errno.h>
#include <set>
#include <map>
#include <typeinfo>
#include <boost/foreach.hpp>
#include <boost/optional.hpp>
Go to the source code of this file.
Namespaces | |
namespace | cart_local_planner |
namespace | cart_pushing_msgs |
Typedefs | |
typedef tf::Stamped< tf::Pose > | cart_local_planner::StampedPose |
Functions | |
template<class T > | |
T | cart_local_planner::clamp (T val, T abs_max) |
template<typename T > | |
void | cart_local_planner::getParam (const ros::NodeHandle nh, const string &name, T *place) |
double | cart_local_planner::mag (geometry_msgs::Pose2D &p) |
double | cart_local_planner::mag (gm::Twist &t) |
const gm::Twist | cart_local_planner::operator+ (const gm::Twist &t1, const gm::Twist &t2) |
const gm::Twist | cart_local_planner::operator- (const gm::Twist &t1, const gm::Twist &t2) |
bool | cart_pushing_msgs::operator== (const cart_pushing_msgs::RobotCartPath &sbpl_plan, const std::vector< gm::PoseStamped > &mb_plan) |
gm::Twist | cart_local_planner::scaleTwist (const gm::Twist &twist, const double scaling_factor) |
Note: discards non-2d components. | |
Variables | |
const double | cart_local_planner::SBPL_DTHRESH = -0.013 |
Definition in file cart_local_planner.cpp.