Functions | Variables
test_optim_node.cpp File Reference
#include <teb_local_planner/teb_local_planner_ros.h>
#include <interactive_markers/interactive_marker_server.h>
#include <visualization_msgs/Marker.h>
#include <boost/shared_ptr.hpp>
#include <boost/make_shared.hpp>
Include dependency graph for test_optim_node.cpp:

Go to the source code of this file.

Functions

void CB_clicked_points (const geometry_msgs::PointStampedConstPtr &point_msg)
 
void CB_customObstacle (const costmap_converter::ObstacleArrayMsg::ConstPtr &obst_msg)
 
void CB_mainCycle (const ros::TimerEvent &e)
 
void CB_obstacle_marker (const visualization_msgs::InteractiveMarkerFeedbackConstPtr &feedback)
 
void CB_publishCycle (const ros::TimerEvent &e)
 
void CB_reconfigure (TebLocalPlannerReconfigureConfig &reconfig, uint32_t level)
 
void CB_setObstacleVelocity (const geometry_msgs::TwistConstPtr &twist_msg, const unsigned int id)
 
void CB_via_points (const nav_msgs::Path::ConstPtr &via_points_msg)
 
void CreateInteractiveMarker (const double &init_x, const double &init_y, unsigned int id, std::string frame, interactive_markers::InteractiveMarkerServer *marker_server, interactive_markers::InteractiveMarkerServer::FeedbackCallback feedback_cb)
 
int main (int argc, char **argv)
 

Variables

ros::Subscriber clicked_points_sub
 
TebConfig config
 
ros::Subscriber custom_obst_sub
 
boost::shared_ptr< dynamic_reconfigure::Server< TebLocalPlannerReconfigureConfig > > dynamic_recfg
 
unsigned int no_fixed_obstacles
 
std::vector< ObstaclePtrobst_vector
 
std::vector< ros::Subscriberobst_vel_subs
 
PlannerInterfacePtr planner
 
ViaPointContainer via_points
 
ros::Subscriber via_points_sub
 
TebVisualizationPtr visual
 

Function Documentation

void CB_clicked_points ( const geometry_msgs::PointStampedConstPtr &  point_msg)

Definition at line 290 of file test_optim_node.cpp.

void CB_customObstacle ( const costmap_converter::ObstacleArrayMsg::ConstPtr &  obst_msg)

Definition at line 250 of file test_optim_node.cpp.

void CB_mainCycle ( const ros::TimerEvent e)

Definition at line 166 of file test_optim_node.cpp.

void CB_obstacle_marker ( const visualization_msgs::InteractiveMarkerFeedbackConstPtr &  feedback)

Definition at line 238 of file test_optim_node.cpp.

void CB_publishCycle ( const ros::TimerEvent e)

Definition at line 172 of file test_optim_node.cpp.

void CB_reconfigure ( TebLocalPlannerReconfigureConfig &  reconfig,
uint32_t  level 
)

Definition at line 179 of file test_optim_node.cpp.

void CB_setObstacleVelocity ( const geometry_msgs::TwistConstPtr &  twist_msg,
const unsigned int  id 
)

Definition at line 310 of file test_optim_node.cpp.

void CB_via_points ( const nav_msgs::Path::ConstPtr &  via_points_msg)

Definition at line 300 of file test_optim_node.cpp.

void CreateInteractiveMarker ( const double &  init_x,
const double &  init_y,
unsigned int  id,
std::string  frame,
interactive_markers::InteractiveMarkerServer marker_server,
interactive_markers::InteractiveMarkerServer::FeedbackCallback  feedback_cb 
)

Definition at line 184 of file test_optim_node.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 77 of file test_optim_node.cpp.

Variable Documentation

ros::Subscriber clicked_points_sub

Definition at line 60 of file test_optim_node.cpp.

TebConfig config

Definition at line 56 of file test_optim_node.cpp.

ros::Subscriber custom_obst_sub

Definition at line 58 of file test_optim_node.cpp.

boost::shared_ptr< dynamic_reconfigure::Server<TebLocalPlannerReconfigureConfig> > dynamic_recfg

Definition at line 57 of file test_optim_node.cpp.

unsigned int no_fixed_obstacles

Definition at line 62 of file test_optim_node.cpp.

std::vector<ObstaclePtr> obst_vector

Definition at line 54 of file test_optim_node.cpp.

std::vector<ros::Subscriber> obst_vel_subs

Definition at line 61 of file test_optim_node.cpp.

Definition at line 52 of file test_optim_node.cpp.

ViaPointContainer via_points

Definition at line 55 of file test_optim_node.cpp.

ros::Subscriber via_points_sub

Definition at line 59 of file test_optim_node.cpp.

Definition at line 53 of file test_optim_node.cpp.



teb_local_planner
Author(s): Christoph Rösmann
autogenerated on Wed Jun 3 2020 04:03:08