-
Notifications
You must be signed in to change notification settings - Fork 52
Commit
This commit does not belong to any branch on this repository, and may belong to a fork outside of the repository.
feat(autoware_planning_msgs): move tier4_planning_msgs to autoware_pl…
…anning_msgs Signed-off-by: liu cui <cynthia.liu@autocore.ai>
- Loading branch information
Showing
26 changed files
with
178 additions
and
0 deletions.
There are no files selected for viewing
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,9 @@ | ||
string object_id | ||
bool allow_avoidance | ||
float64 longitudinal_distance | ||
float64 lateral_distance_from_centerline | ||
float64 to_furthest_linestring_distance | ||
float64 max_shift_length | ||
float64 required_jerk | ||
float64 maximum_jerk | ||
string failed_reason |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,2 @@ | ||
std_msgs/Header header | ||
autoware_planning_msgs/AvoidanceDebugMsg[] avoidance_info |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,4 @@ | ||
geometry_msgs/Pose pose | ||
float32 velocity | ||
float32 shift_length | ||
float32 distance |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,2 @@ | ||
builtin_interfaces/Time stamp | ||
float32 expand_stop_range |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,2 @@ | ||
builtin_interfaces/Time stamp | ||
float32 lateral_offset |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,2 @@ | ||
std_msgs/Header header | ||
autoware_planning_msgs/PathChangeModuleId module |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,8 @@ | ||
int32 type | ||
|
||
int32 NONE = 0 | ||
int32 AVOIDANCE = 1 | ||
int32 LANE_CHANGE = 2 | ||
int32 FORCE_LANE_CHANGE = 3 | ||
int32 GOAL_PLANNER = 4 | ||
int32 START_PLANNER = 5 |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,2 @@ | ||
autoware_planning_msgs/PathPoint point | ||
int64[] lane_ids |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,4 @@ | ||
std_msgs/Header header | ||
autoware_planning_msgs/PathPointWithLaneId[] points | ||
geometry_msgs/Point[] left_bound | ||
geometry_msgs/Point[] right_bound |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,20 @@ | ||
# constants for behavior | ||
uint16 UNKNOWN = 0 | ||
uint16 NONE = 1 | ||
uint16 SLOW_DOWN = 2 | ||
uint16 STOP = 3 | ||
uint16 LEFT_SHIFT = 4 | ||
uint16 RIGHT_SHIFT = 5 | ||
|
||
# variables | ||
string module | ||
|
||
bool is_driving_forward | ||
|
||
autoware_planning_msgs/ControlPoint[] control_points | ||
|
||
uint16 behavior | ||
|
||
string detail | ||
|
||
autoware_planning_msgs/SafetyFactorArray safety_factors |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,2 @@ | ||
std_msgs/Header header | ||
autoware_planning_msgs/PlanningFactor[] factors |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,2 @@ | ||
builtin_interfaces/Time stamp | ||
bool availability |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,12 @@ | ||
uint8 UNKNOWN = 0 | ||
uint8 INITIALIZING = 1 | ||
uint8 UNSET = 2 | ||
uint8 ROUTING = 3 | ||
uint8 SET = 4 | ||
uint8 REROUTING = 5 | ||
uint8 ARRIVED = 6 | ||
uint8 ABORTED = 7 | ||
uint8 INTERRUPTED = 8 | ||
|
||
builtin_interfaces/Time stamp | ||
uint8 state |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,27 @@ | ||
# constants for common use | ||
uint16 UNKNOWN = 0 | ||
|
||
# constants for factor type | ||
uint16 POINTCLOUD = 1 | ||
uint16 OBJECT = 2 | ||
|
||
# variables | ||
uint16 type | ||
|
||
# use only for predicted objects | ||
unique_identifier_msgs/UUID object_id | ||
|
||
# use only for predicted objects | ||
autoware_perception_msgs/PredictedPath predicted_path | ||
|
||
# time to collision in relative to the header time | ||
float32 ttc_begin | ||
|
||
float32 ttc_end | ||
|
||
# type == POINTCLOUD: the position of the each points | ||
# type == OBJECT: the object position | ||
geometry_msgs/Point[] points | ||
|
||
# module's primitive judgement of the safety for its decision | ||
bool is_safe |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,4 @@ | ||
std_msgs/Header header | ||
autoware_planning_msgs/SafetyFactor[] factors | ||
bool is_safe | ||
string detail |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,6 @@ | ||
string EMPTY=Empty | ||
string LANEDRIVING=LaneDriving | ||
string PARKING=Parking | ||
|
||
string current_scenario | ||
string[] activating_scenarios |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,3 @@ | ||
geometry_msgs/Pose stop_pose | ||
float64 dist_to_stop_pose | ||
geometry_msgs/Point[] stop_factor_points |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,2 @@ | ||
builtin_interfaces/Time stamp | ||
bool stop_speed_exceeded |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,7 @@ | ||
builtin_interfaces/Time stamp | ||
float32 max_velocity | ||
|
||
bool use_constraints false | ||
autoware_planning_msgs/VelocityLimitConstraints constraints | ||
|
||
string sender |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,3 @@ | ||
builtin_interfaces/Time stamp | ||
bool command false | ||
string sender |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,11 @@ | ||
# maximum signed acceleration | ||
float32 max_acceleration | ||
|
||
# minimum signed acceleration | ||
float32 min_acceleration | ||
|
||
# maximum signed jerk | ||
float32 max_jerk | ||
|
||
# minimum signed jerk | ||
float32 min_jerk |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,2 @@ | ||
--- | ||
autoware_common_msgs/ResponseStatus status |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,7 @@ | ||
std_msgs/Header header | ||
geometry_msgs/Pose goal_pose | ||
autoware_planning_msgs/LaneletSegment[] segments | ||
unique_identifier_msgs/UUID uuid | ||
bool allow_modification | ||
--- | ||
autoware_common_msgs/ResponseStatus status |
This file contains bidirectional Unicode text that may be interpreted or compiled differently than what appears below. To review, open the file in an editor that reveals hidden Unicode characters.
Learn more about bidirectional Unicode characters
Original file line number | Diff line number | Diff line change |
---|---|---|
@@ -0,0 +1,7 @@ | ||
std_msgs/Header header | ||
geometry_msgs/Pose goal_pose | ||
geometry_msgs/Pose[] waypoints | ||
unique_identifier_msgs/UUID uuid | ||
bool allow_modification | ||
--- | ||
autoware_common_msgs/ResponseStatus status |