Skip to content

Commit 419f787

Browse files
Michael WiznitzerMichael Wiznitzer
authored andcommitted
address some feedback
1 parent 7fe1740 commit 419f787

File tree

2 files changed

+0
-8
lines changed

2 files changed

+0
-8
lines changed

action/GlobalPlanner.action

Lines changed: 0 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -1,6 +1,3 @@
1-
# This is a modified version of GlobalPlanner.action from ros-planning/moveit_msgs.
2-
# A JointTrajectory was added so that timing information is retained.
3-
41
# Motion planning request to the global planner
52
string planning_group
63
trajectory_msgs/JointTrajectory trajectory

msg/MotionPlanRequest.msg

Lines changed: 0 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -53,15 +53,10 @@ float64 max_acceleration_scaling_factor
5353

5454
# New joint limits to use when running time-parameterization and smoothing.
5555
# Note, this does not replace the values in the robot model.
56-
# Only applicable for TOTG and Ruckig
5756
# Set the 'has_limits' field to true for velocity, acceleration, and/or jerk
5857
# in order for that limit to be applied. Position limits are not supported.
5958
JointLimits[] joint_limits
6059

61-
# If true, use the joint limits defined in the 'joint_limits' field.
62-
# Otherwise, use the max scaling factors defined for velocity and acceleration
63-
bool use_joint_limits
64-
6560
# If true, smoothing will be skipped when applying a smoothing adapter during
6661
# trajectory processing (if it is defined as a request adapter).
6762
bool skip_smoothing

0 commit comments

Comments
 (0)