#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>
Go to the source code of this file.
| Functions | |
| void | CB_clicked_points (const geometry_msgs::PointStampedConstPtr &point_msg) | 
| void | CB_customObstacle (const teb_local_planner::ObstacleMsg::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 | 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< ObstaclePtr > | obst_vector | 
| PlannerInterfacePtr | planner | 
| ViaPointContainer | via_points | 
| TebVisualizationPtr | visual | 
| void CB_clicked_points | ( | const geometry_msgs::PointStampedConstPtr & | point_msg | ) | 
Definition at line 261 of file test_optim_node.cpp.
| void CB_customObstacle | ( | const teb_local_planner::ObstacleMsg::ConstPtr & | obst_msg | ) | 
Definition at line 235 of file test_optim_node.cpp.
| void CB_mainCycle | ( | const ros::TimerEvent & | e | ) | 
Definition at line 153 of file test_optim_node.cpp.
| void CB_obstacle_marker | ( | const visualization_msgs::InteractiveMarkerFeedbackConstPtr & | feedback | ) | 
Definition at line 223 of file test_optim_node.cpp.
| void CB_publishCycle | ( | const ros::TimerEvent & | e | ) | 
Definition at line 159 of file test_optim_node.cpp.
| void CB_reconfigure | ( | TebLocalPlannerReconfigureConfig & | reconfig, | 
| uint32_t | level | ||
| ) | 
Definition at line 166 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 171 of file test_optim_node.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 73 of file test_optim_node.cpp.
Definition at line 59 of file test_optim_node.cpp.
Definition at line 56 of file test_optim_node.cpp.
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 60 of file test_optim_node.cpp.
| std::vector<ObstaclePtr> obst_vector | 
Definition at line 54 of file test_optim_node.cpp.
Definition at line 52 of file test_optim_node.cpp.
Definition at line 55 of file test_optim_node.cpp.
Definition at line 53 of file test_optim_node.cpp.