Coder Social home page Coder Social logo

cone_planner's Introduction

cone_planner

Installation

rosdep install --from-paths src --ignore-src -y
colcon build --symlink-install --cmake-args -DCMAKE_BUILD_TYPE=Release -DCMAKE_EXPORT_COMPILE_COMMANDS=On --packages-up-to cone_planner

Usage

ros2 launch cone_planner cone_planner.launch.py vehicle_param_file:=PATH_TO_VEHICLE_PARM_FILE

API

Input

Name Type Description
~/input/trajectory autoware_auto_planning_msgs::msg::Trajectory Reference trajectory
~/input/occupancy_grid nav_msgs::msg::OccupancyGrid Occupancy grid map
~/input/pose geometry_msgs::msg::PoseStamped Pose of the car
~/input/odom nav_msgs::msg::Odometry Odometry used for checking stop condition

Output

Name Type Description
~/output/trajectory autoware_auto_planning_msgs::msg::Trajectory Planned trajectory

Parameters

Name Type Description
update_rate float Update rate of checking if replanning is needed
waypoints_velocity float Reference velocity at planned trajectory points
vehicle_shape_margin_m float Car perimeter margin used for planning
th_arrived_distance_m float Distance between car and goal point to consider that goal has been achieved
th_stopped_time_sec float Time after stopping to consider that the car stopped successfully
th_stopped_velocity_mps float Velocity threshold to consider that the car stopped
th_course_out_distance_m float Distance between car and planned trajectory to consider above which replanning is triggered
c_space_margin_m float C space margin
replan_when_obstacle_found bool True if replanning should be triggered when new obstacle was found
replan_when_course_out bool True if replanning should be triggered when the car is out of the planned trajectory
time_limit float Max until finding path
minimum_turning_radius float Min car turning radius
theta_size int Discretization resolution of the heading angle range
obstacle_threshold int Cost value threshold to be considered an obstacle
rrt_enable_update bool True if planning should be continued after finding path to the goal pose
rrt_max_planning_time float Max time of planning
rrt_margin float Additional car perimeter margin used in planner
rrt_neighbor_radius float Radius in which checking if shorter path exist through other neighbor is performed

cone_planner's People

Contributors

arafalski avatar

Watchers

 avatar

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    ๐Ÿ–– Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. ๐Ÿ“Š๐Ÿ“ˆ๐ŸŽ‰

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google โค๏ธ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.