<> <> == Overview == '''''Update:'' Two tutorials on planning with dynamic obstacles added ([[teb_local_planner/Tutorials|click here]])''' This package implements an online optimal local trajectory planner for navigation and control of mobile robots as a plugin for the ROS [[navigation]] package. The initial trajectory generated by a global planner is optimized during runtime w.r.t. minimizing the trajectory execution time (time-optimal objective), separation from obstacles and compliance with kinodynamic constraints such as satisfying maximum velocities and accelerations. The current implementation complies with the kinematics of non-holonomic robots (differential drive and car-like robots). Support of holonomic robots is included since Kinetic. The optimal trajectory is efficiently obtained by solving a sparse scalarized multi-objective optimization problem. The user can provide weights to the optimization problem in order to specify the behavior in case of conflicting objectives. The approach called "Timed-Elastic-Band" is presented in: *C. Rösmann, W. Feiten, T. Wösch, F. Hoffmann and T. Bertram: Trajectory modification considering dynamic constraints of autonomous robots. Proc. 7th German Conference on Robotics, Germany, Munich, 2012, pp 74–79. *C. Rösmann, W. Feiten, T. Wösch, F. Hoffmann and T. Bertram: Efficient trajectory optimization using a sparse model. Proc. IEEE European Conference on Mobile Robots, Spain, Barcelona, 2013, pp. 138–143. Since local planners such as the Timed-Elastic-Band get often stuck in a locally optimal trajectory as they are unable to transit across obstacles, an extension is implemented. A subset of admissible trajectories of distinctive topologies is optimized in parallel. The local planner is able to switch to the current globally optimal trajectory among the candidate set. Distinctive topologies are obtained by utilizing the concept of homology / homotopy classes. The following papers are describing the approach *C. Rösmann, F. Hoffmann and T. Bertram: Integrated online trajectory planning and optimization in distinctive topologies, Robotics and Autonomous Systems, Vol. 88, 2017, pp. 142–153. *C. Rösmann, F. Hoffmann and T. Bertram: Planning of Multiple Robot Trajectories in Distinctive Topologies, Proc. IEEE European Conference on Mobile Robots, UK, Lincoln, Sept. 2015 The extension to car-like robots is described in *C. Rösmann, F. Hoffmann and T. Bertram: Kinodynamic Trajectory Optimization and Control for Car-Like Robots, IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Vancouver, BC, Canada, Sept. 2017. Get started by completing the tutorials in the [[teb_local_planner/Tutorials|Tutorials]] section. <> == Video == The following video presents the features of the package and shows examples from simulation and real robot situations. Some spoken explanations are included in the audio track of the video. <> Features introduced in '''version 0.2''' are presented in the following video (supporting car-like robots and costmap conversion). <> == Node API == === Topics === {{{ #!clearsilver CS/NodeAPI pub { 0.name = ~/global_plan 0.type = nav_msgs/Path 0.desc = Global plan that the local planner is currently attempting to follow. Used primarily for visualization purposes. 1.name = ~/local_plan 1.type = nav_msgs/Path 1.desc = The local plan or trajectory that the teb_local_planner optimizes and follows. Used primarily for visualization purposes. 2.name = ~/teb_poses 2.type = geometry_msgs/PoseArray 2.desc = The discrete pose list (SE2) of the current local plan. Used primarily for visualization purposes. 3.name = ~/teb_markers 3.type = visualization_msgs/Marker 3.desc = The teb_local_planner provides additional information of the planning scene via markers with different namespaces. Namespaces ''PointObstacles'' and ''PolyObstacles'': visualize all point and polygon obstacles that are currently considered during optimization. Namespace ''TebContainer'': Visualize all found and optimized trajectories that rest in alternative topologies (only if parallel planning is enabled). Some more information is published such as the optimization footprint model. 4.name = ~/teb_feedback 4.type = teb_local_planner/FeedbackMsg 4.desc = The feedback message contains the planned trajectory including the velocity profile and temporal information as well as the obstacle list. Used primarily for evaluation and debugging. Parameter `~/publish_feedback` must be enabled. } }}} {{{ #!clearsilver CS/NodeAPI sub { 0.name = ~/odom 0.type = nav_msgs/Odometry 0.desc = Odometry information that gives the local planner the current speed of the robot. Change this topic by either remapping or by changing the parameter `~/odom_topic`. 1.name = ~/obstacles 1.type = costmap_converter/ObstacleArrayMsg 1.desc = Provide custom obstacles as point-, line- or polygon-shaped ones (additionally to or instead of the costmap obstacles). } }}} {{{{#!wiki version kinetic_and_newer {{{ #!clearsilver CS/NodeAPI sub { no_header=True 0.name = ~/via_points 0.type = nav_msgs/Path 0.desc = Provide custom via-points (you need to set `~/global_plan_viapoint_sep` to zero or negative) } }}} }}}} === Parameters === The teb_local_planner package allows the user to set [[Parameters]] in order to customize the behavior. These parameters are grouped into several categories: robot configuration, goal tolerance, trajectory configuration, obstacles, optimization, planning in distinctive topologies and miscellaneous parameters. Some of them are chosen to be compliant with the [[base_local_planner]]. Many (but not all) parameters can be modified at runtime using [[rqt_reconfigure]]. ==== Robot Configuration Parameters ==== {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/acc_lim_x 0.default = 0.5 0.type = double 0.desc = Maximum translational acceleration of the robot in meters/sec^2 1.name = ~/acc_lim_theta 1.default = 0.5 1.type = double 1.desc = Maximum angular acceleration of the robot in radians/sec^2 2.name = ~/max_vel_x 2.default = 0.4 2.type = double 2.desc = Maximum translational velocity of the robot in meters/sec 3.name = ~/max_vel_x_backwards 3.default = 0.2 3.type = double 3.desc = Maximum absolute translational velocity of the robot while driving backwards in meters/sec. See optimization parameter `weight_kinematics_forward_drive` 4.name = ~/max_vel_theta 4.default = 0.3 4.type = double 4.desc = Maximum angular velocity of the robot in radians/sec } }}} The following parameters are relevant only for carlike robots: {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/min_turning_radius 0.default = 0.0 0.type = double 0.desc = Minimum turning radius of a carlike robot (set to zero for a diff-drive robot). 1.name = ~/wheelbase 1.default = 1.0 1.type = double 1.desc = The distance between the rear axle and the front axle. The value might be negative for back-wheeled robots (only required if `~/cmd_angle_instead_rotvel`is set to `true`). 2.name = ~/cmd_angle_instead_rotvel 2.default = false 2.type = bool 2.desc = Substitute the rotational velocity in the commanded velocity message by the corresponding steering angle [-pi/2,pi/2]. ''Note, changing the semantics of yaw rate depending on the application is not preferable. Here, it just complies with the inputs required by the stage simulator. Datatypes in [[ackermann_msgs]] are more appropriate, but are not supported by move_base. The local planner is not intended to send commands by itself. '' } }}} {{{{#!wiki version kinetic_and_newer The following parameters are relevant only for holonomic robots: <> '''Note''', reduce `~/weight_kinematics_nh` significantly in order to adjust the tradeoff between compliant longitudinal motion and non-compliant lateral motion (strafing). {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/max_vel_y 0.default = 0.0 0.type = double 0.desc = Maximum strafing velocity of the robot (should be zero for non-holonomic robots!) 1.name = ~/acc_lim_y 1.default = 0.5 1.type = double 1.desc = Maximum strafing acceleration of the robot } }}} }}}} The following parameters are relevant for the footprint model used for optimization (see [[teb_local_planner/Tutorials/Obstacle Avoidance and Robot Footprint Model|Tutorial Obstacle Avoidance and Robot Footprint Model]]). ''' New in version 0.3''' {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/footprint_model/type 0.default = "point" 0.type = string 0.desc = Specify the robot footprint model type used for optimization. Different types are "point", "circular", "line", "two_circles" and "polygon." The type of the model significantly influences the required computation time. 1.name = ~/footprint_model/radius 1.default = 0.2 1.type = double 1.desc = This parameter is only relevant for type "circular". It contains the radius of the circle. The center of the circle is located at the robot's axis of rotation. 2.name = ~/footprint_model/line_start 2.default = [-0.3, 0.0] 2.type = double[2] 2.desc = This parameter is only relevant for type "line". It contains the start coordinates of the line segment. 3.name = ~/footprint_model/line_end 3.default = [0.3, 0.0] 3.type = double[2] 3.desc = This parameter is only relevant for type "line". It contains the end coordinates of the line segment. 4.name = ~/footprint_model/front_offset 4.default = 0.2 4.type = double 4.desc = This parameter is only relevant for type "two_circles". It describes how much the center of the front circle is shifted along the robot's x-axis. The robot's axis of rotation is assumed to be located at [0,0]. 5.name = ~/footprint_model/front_radius 5.default = 0.2 5.type = double 5.desc = This parameter is only relevant for type "two_circles". It contains the radius of front circle. 6.name = ~/footprint_model/rear_offset 6.default = 0.2 6.type = double 6.desc = This parameter is only relevant for type "two_circles". It describes how much the center of the rear circle is shifted along the robot's negative x-axis. The robot's axis of rotation is assumed to be located at [0,0]. 7.name = ~/footprint_model/rear_radius 7.default = 0.2 7.type = double 7.desc = This parameter is only relevant for type "two_circles". It contains the radius of rear circle. 8.name = ~/footprint_model/vertices 8.default = [ [0.25,-0.05], [...], ...] 8.type = double[] 8.desc = This parameter is only relevant for type "polygon". It contains the list of polygon vertices (2d coordinates each). The polygon is always closed: do not repeat the first vertex at the end. 9.name = ~/is_footprint_dynamic 9.default = false 9.type = bool 9.desc = If true, updates the footprint before checking trajectory feasibility } }}} ==== Goal Tolerance Parameters ==== {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/xy_goal_tolerance 0.default = 0.2 0.type = double 0.desc = Allowed final euclidean distance to the goal position in meters 1.name = ~/yaw_goal_tolerance 1.default = 0.2 1.type = double 1.desc = Allowed final orientation error in radians 2.name = ~/free_goal_vel 2.default = false 2.type = bool 2.desc = Remove the goal velocity constraint such that the robot can arrive at the goal with maximum speed } }}} ==== Trajectory Configuration Parameters ==== {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/dt_ref 0.default = 0.3 0.type = double 0.desc = Desired temporal resolution of the trajectory (the trajectory is not fixed to `dt_ref` since the temporal resolution is part of the optimization, but the trajectory will be resized between iterations if ''dt_ref +-dt_hysteresis'' is violated. 1.name = ~/dt_hysteresis 1.default = 0.1 1.type = double 1.desc = Hysteresis for automatic resizing depending on the current temporal resolution, usually approx. 10% of `dt_ref` is recommended 2.name = ~/min_samples 2.default = 3 2.type = int 2.desc = Minimum number of samples (should be always greater than 2) 3.name = ~/global_plan_overwrite_orientation 3.default = true 3.type = bool 3.desc = Overwrite orientation of local subgoals provided by the global planner (since they often provide only a 2D path) 4.name = ~/global_plan_viapoint_sep 4.default = -0.1 (disabled) 4.type = double 4.desc = If positive, via-points are extrected from the global plan (path-following mode). The value determines the resolution of the reference path (min. separation between each two consecutive via-points along the global plan, if negative: disabled). Refer to parameter `weight_viapoint` for adjusting the intensity. '''New in version 0.4''' 5.name = ~/max_global_plan_lookahead_dist 5.default = 3.0 5.type = double 5.desc = Specify the maximum length (cumulative Euclidean distances) of the subset of the global plan taken into account for optimization. The actual length is than determined by the logical conjunction of the local costmap size and this maximum bound. Set to zero or negative in order to deactivate this limitation. 6.name = ~/force_reinit_new_goal_dist 6.default = 1.0 6.type = double 6.desc = Reinitialize the trajectory if a previous goal is updated with a separation of more than the specified value in meters (skip hot-starting) 7.name = ~/feasibility_check_no_poses 7.default = 4 7.type = int 7.desc = Specify up to which pose on the predicted plan the feasibility should be checked each sampling interval. 8.name = ~/publish_feedback 8.default = false 8.type = bool 8.desc = Publish planner feedback containing the full trajectory and a list of active obstacles (should be enabled only for evaluation or debugging). See list of publishers above. 9.name = ~/shrink_horizon_backup 9.default = true 9.type = bool 9.desc = Allows the planner to shrink the horizon temporary (50%) in case of automatically detected issues (e.g. infeasibility). Also see parameter `shrink_horizon_min_duration`. } }}} {{{{#!wiki version kinetic_and_newer {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/allow_init_with_backwards_motion 0.default = false 0.type = bool 0.desc = If true, underlying trajectories might be initialized with backwards motions in case the goal is behind the start within the local costmap (this is only recommended if the robot is equipped with rear sensors). 1.name = ~/exact_arc_length 1.default = false 1.type = bool 1.desc = If true, the planner uses the exact arc length in velocity, acceleration and turning rate computations (-> increased cpu time), otherwise the Euclidean approximation is used. 2.name = ~/shrink_horizon_min_duration 2.default = 10.0 2.type = double 2.desc = Specify minimum duration for the reduced horizon in case an infeasible trajectory is detected (refer to parameter `shrink_horizon_backup` in order to activate the reduced horizon mode). } }}} }}}} ==== Obstacle Parameters ==== {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/min_obstacle_dist 0.default = 0.5 0.type = double 0.desc = Minimum desired separation from obstacles in meters 1.name = ~/include_costmap_obstacles 1.default = true 1.type = bool 1.desc = Specify if obstacles of the local costmap should be taken into account. Each cell that is marked as obstacle is considered as a point-obstacle. Therefore do not choose a very small resolution of the costmap since it increases computation time. In future releases this circumstance is going to be addressed as well as providing an additional api for dynamic obstacles. 2.name = ~/costmap_obstacles_behind_robot_dist 2.default = 1.0 2.type = double 2.desc = Limit the occupied local costmap obstacles taken into account for planning behind the robot (specify distance in meters). 3.name = ~/obstacle_poses_affected 3.default = 30 3.type = int 3.desc = Each obstacle position is attached to the closest pose on the trajectory in order to keep a distance. Additional neighbors can be taken into account as well. Note, this parameter might be removed in future versions, since the the obstacle association strategy has been modified in kinetic+. Refer to the parameter description of `legacy_obstacle_association`. 4.name = ~/inflation_dist 4.default = pre kinetic: 0.0, kinetic+: 0.6 4.type = double 4.desc = Buffer zone around obstacles with non-zero penalty costs (should be larger than `min_obstacle_dist` in order to take effect). Also refer to the weight `weight_inflation`. } }}} {{{{#!wiki version kinetic_and_newer {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/include_dynamic_obstacles 0.default = false 0.type = bool 0.desc = If this parameter is set to true, the motion of obstacles with non-zero velocity (provided via user-supplied obstacles on topic `~/obstacles` or obtained from the [[costmap_converter]]) is predicted and considered during optimization via a constant velocity model. '''New''' 1.name = ~/legacy_obstacle_association 1.default = false 1.type = bool 1.desc = The strategy of connecting trajectory poses with obstacles for optimization has been modified (see changelog). You can switch to the old/previous strategy by setting this parameter to `true`. Old strategy: for each obstacle, find the nearest TEB pose; new strategy: for each teb pose, find only "relevant" obstacles. 2.name = ~/obstacle_association_force_inclusion_factor 2.default = 1.5 2.type = double 2.desc = The non-legacy obstacle association strategy tries to connect only relevant obstacles with the discretized trajectory during optimization. But all obstacles within a specifed distance are forced to be included (as a multiple of `min_obstacle_dist`). E.g. choose 2.0 in order to`enforce the consideration obstacles within a radius of 2.0*`min_obstacle_dist. [This parameter is used only if parameter `legacy_obstacle_association` is `false`] 3.name = ~/obstacle_association_cutoff_factor 3.default = 5 3.type = double 3.desc = See `obstacle_association_force_inclusion_factor`, but beyond a multiple of [value]*`min_obstacle_dist` all obstacles are ignored during optimization. Parameter `obstacle_association_force_inclusion_factor` is processed first. [This parameter is used only if parameter `legacy_obstacle_association` is `false`] } }}} }}}} The following parameters are relevant only if [[costmap_converter]] plugins are desired (see tutorial): {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/costmap_converter_plugin 0.default = "" 0.type = string 0.desc = Define plugin name in order to convert costmap cells to points/lines/polygons. Set an empty string to disable the conversion such that all cells are treated as point-obstacles. 1.name = ~/costmap_converter_spin_thread 1.default = true 1.type = bool 1.desc = If set to true, the costmap converter invokes its callback queue in a different thread. 2.name = ~/costmap_converter_rate 2.default = 5.0 2.type = double 2.desc = Rate that defines how often the costmap_converter plugin processes the current costmap (the value should not be much higher than the costmap update rate) [in Hz]. } }}} ==== Optimization Parameters ==== {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/no_inner_iterations 0.default = 5 0.type = int 0.desc = Number of actual solver iterations called in each ''outerloop'' iteration. See param `no_outer_iterations`. 1.name = ~/no_outer_iterations 1.default = 4 1.type = int 1.desc = Each outerloop iteration automatically resizes the trajectory according to the desired temporal resolution `dt_ref` and invokes the internal optimizer (that performs `no_inner_iterations`). The total number of solver iterations in each planning cycle is therefore the product of both values. 2.name = ~/penalty_epsilon 2.default = 0.1 2.type = double 2.desc = Add a small safety margin to penalty functions for hard-constraint approximations 3.name = ~/weight_max_vel_x 3.default = 2.0 3.type = double 3.desc = Optimization weight for satisfying the maximum allowed translational velocity 4.name = ~/weight_max_vel_theta 4.default = 1.0 4.type = double 4.desc = Optimization weight for satisfying the maximum allowed angular velocity 5.name = ~/weight_acc_lim_x 5.default = 1.0 5.type = double 5.desc = Optimization weight for satisfying the maximum allowed translational acceleration 6.name = ~/weight_acc_lim_theta 6.default = 1.0 6.type = double 6.desc = Optimization weight for satisfying the maximum allowed angular acceleration 7.name = ~/weight_kinematics_nh 7.default = 1000.0 7.type = double 7.desc = Optimization weight for satisfying the non-holonomic kinematics (this parameter must be high since the kinematics equation constitutes an equality constraint, even a value of 1000 does not imply a bad matrix condition due to small 'raw' cost values in comparison to other costs). 8.name = ~/weight_kinematics_forward_drive 8.default = 1.0 8.type = double 8.desc = Optimization weight for forcing the robot to choose only forward directions (positive transl. velocities). A small weight (e.g. 1.0) still allows driving backwards. A value around 1000 almost prevents backward driving (but cannot be guaranteed). 9.name = ~/weight_kinematics_turning_radius 9.default = 1.0 9.type = double 9.desc = Optimization weight for enforcing a minimum turning radius (only for carlike robots). 10.name = ~/weight_optimaltime 10.default = 1.0 10.type = double 10.desc = Optimization weight for contracting the trajectory w.r.t transition/execution time 11.name = ~/weight_obstacle 11.default = 50.0 11.type = double 11.desc = Optimization weight for keeping a minimum distance from obstacles 12.name = ~/weight_viapoint 12.default = 1.0 12.type = double 12.desc = Optimization weight for minimzing the distance to via-points (resp. reference path). '''New in version 0.4''' 13.name = ~/weight_inflation 13.default = 0.1 13.type = double 13.desc = Optimization weight for the inflation penalty (should be small). } }}} {{{{#!wiki version kinetic_and_newer {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/weight_adapt_factor 0.default = 2.0 0.type = double 0.desc = Some special weights (currently `weight_obstacle`) are repeatedly scaled by this factor in each outer TEB iteration (weight_new = weight_old*factor). Increasing weights iteratively instead of setting a huge value a-priori leads to better numerical conditions of the underlying optimization problem. } }}} }}}} ==== Parallel Planning in distinctive Topologies ==== {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/enable_homotopy_class_planning 0.default = true 0.type = bool 0.desc = Activate parallel planning in distinctive topologies (requires much more CPU resources, since multiple trajectories are optimized at once) 1.name = ~/enable_multithreading 1.default = true 1.type = bool 1.desc = Activate multiple threading in order to plan each trajectory in a different thread 2.name = ~/max_number_classes 2.default = 4 2.type = int 2.desc = Specify the maximum number of distinctive trajectories taken into account (limits computational effort) 3.name = ~/selection_cost_hysteresis 3.default = 1.0 3.type = double 3.desc = Specify how much trajectory cost must a new candidate have w.r.t. a previously selected trajectory in order to be selected (selection if new_cost < old_cost*factor). 4.name = ~/selection_obst_cost_scale 4.default = 100.0 4.type = double 4.desc = Extra scaling of obstacle cost terms just for selecting the 'best' candidate. 5.name = ~/selection_viapoint_cost_scale 5.default = 1.0 5.type = double 5.desc = Extra scaling of via-point cost terms just for selecting the 'best' candidate. '''New in version 0.4''' 6.name = ~/selection_alternative_time_cost 6.default = false 6.type = bool 6.desc = If true, time cost (sum of squared time differences) is replaced by the total transition time (sum of time differences). 7.name = ~/roadmap_graph_no_samples 7.default = 15 7.type = int 7.desc = Specify the number of samples generated for creating the roadmap graph 8.name = ~/roadmap_graph_area_width 8.default = 6 8.type = double 8.desc = Random keypoints/waypoints are sampled in a rectangular region between start and goal. Specify the width of that region in meters. 9.name = ~/h_signature_prescaler 9.default = 1.0 9.type = double 9.desc = Scale internal parameter (''H-signature'') that is used to distinguish between homotopy classes. Warning: reduce this parameter only, if you observe problems with too many obstacles in the local cost map, do not choose it extremly low, otherwise obstacles cannot be distinguished from each other (0.2<''value''<=1). 10.name = ~/h_signature_threshold 10.default = 0.1 10.type = double 10.desc = Two H-signatures are assumed to be equal, if both the difference of real parts and complex parts are below the specified threshold. 11.name = ~/obstacle_heading_threshold 11.default = 1.0 11.type = double 11.desc = Specify the value of the scalar product between obstacle heading and goal heading in order to take them (obstacles) into account for exploration. 12.name = ~/visualize_hc_graph 12.default = false 12.type = bool 12.desc = Visualize the graph that is created for exploring distinctive trajectories (check marker message in rviz) 13.name = ~/viapoints_all_candidates 13.default = true 13.type = bool 13.desc = If true, all trajectories of different topologies are attached to the set of via-points, otherwise only the trajectory sharing the same topology as the initial/global plan is connected with them (no effect on ''test_optim_node''). '''New in version 0.4''' } }}} {{{{#!wiki version kinetic_and_newer {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/switching_blocking_period 0.default = 0.0 0.type = double 0.desc = Specify a time duration in seconds that needs to be expired before a switch to a new equivalence class is allowed. } }}} }}}} ==== Miscellaneous Parameters ==== {{{ #!clearsilver CS/NodeAPI param{ no_header=True 0.name = ~/odom_topic 0.default = "odom" 0.type = string 0.desc = Topic name of the odometry message, provided by the robot driver or simulator. 1.name = ~/map_frame 1.default = "odom" 1.type = string 1.desc = Global planning frame (in case of a static map, this parameter must be usually changed to "/map". } }}} == Roadmap == Some features and improvements that are currently planned for the future. Contributions are welcome! *Add and improve safety functions in case of unavoidable obstacles (e.g. for obstacles that are located really close to the goal). *Implementation of suitable escape behaviors. *Improvements/Solutions for cases in which the planner oscillates between multiple locally optimal solutions (not on a topologic basis, but due to occuring noise etc.). ## AUTOGENERATED DON'T DELETE ## CategoryPackage