Skip to content

Commit

Permalink
fix typo (#201)
Browse files Browse the repository at this point in the history
  • Loading branch information
howjmay authored May 17, 2023
1 parent 7200623 commit 3558eb3
Show file tree
Hide file tree
Showing 9 changed files with 16 additions and 16 deletions.
2 changes: 1 addition & 1 deletion actionlib/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -123,7 +123,7 @@ Changelog for package actionlib
and of course it will take more time on top of this for the server to actually process the incoming goal and confirm it. Meantime, it may have sent us feedback messages.
* Improved the const-correctness of some actionlib classes. (`#50 <https://github.com/ros/actionlib/issues/50>`_)
* Issue `#51 <https://github.com/ros/actionlib/issues/51>`_: Remove annoying debug messages that make useless to enable debug on Python nodes, as they overwhelm less spamming messages (`#54 <https://github.com/ros/actionlib/issues/54>`_)
* reduce change of unncessary exception on shutdown bu checking directly in before publishing for a shutdown (`#53 <https://github.com/ros/actionlib/issues/53>`_)
* reduce change of unnecessary exception on shutdown bu checking directly in before publishing for a shutdown (`#53 <https://github.com/ros/actionlib/issues/53>`_)
* Contributors: Blake Anderson, Daniel Stonier, Jorge Santos Simón, Mikael Arguedas, uliklank

1.11.6 (2016-06-22)
Expand Down
6 changes: 3 additions & 3 deletions actionlib/include/actionlib/client/comm_state_machine_imp.h
Original file line number Diff line number Diff line change
Expand Up @@ -315,13 +315,13 @@ void CommStateMachine<ActionSpec>::updateStatus(GoalHandleT & gh,
{
switch (goal_status->status) {
case actionlib_msgs::GoalStatus::PENDING:
ROS_ERROR_NAMED("actionlib", "Invalid Transition from WAITING_FOR_RESUT to PENDING");
ROS_ERROR_NAMED("actionlib", "Invalid Transition from WAITING_FOR_RESULT to PENDING");
break;
case actionlib_msgs::GoalStatus::PREEMPTING:
ROS_ERROR_NAMED("actionlib", "Invalid Transition from WAITING_FOR_RESUT to PREEMPTING");
ROS_ERROR_NAMED("actionlib", "Invalid Transition from WAITING_FOR_RESULT to PREEMPTING");
break;
case actionlib_msgs::GoalStatus::RECALLING:
ROS_ERROR_NAMED("actionlib", "Invalid Transition from WAITING_FOR_RESUT to RECALLING");
ROS_ERROR_NAMED("actionlib", "Invalid Transition from WAITING_FOR_RESULT to RECALLING");
break;
case actionlib_msgs::GoalStatus::ACTIVE:
case actionlib_msgs::GoalStatus::PREEMPTED:
Expand Down
2 changes: 1 addition & 1 deletion actionlib/src/actionlib/action_client.py
Original file line number Diff line number Diff line change
Expand Up @@ -179,7 +179,7 @@ def get_goal_status_text(self):

## @brief Gets the result produced by the action server for this goal.
##
## @return None if no result was receieved. Otherwise the goal's result as a *Result message.
## @return None if no result was received. Otherwise the goal's result as a *Result message.
def get_result(self):
if not self.comm_state_machine:
rospy.logerr("Trying to get_result on an inactive ClientGoalHandle.")
Expand Down
2 changes: 1 addition & 1 deletion actionlib/src/actionlib/server_goal_handle.py
Original file line number Diff line number Diff line change
Expand Up @@ -36,7 +36,7 @@ class ServerGoalHandle:
"""
* @class ServerGoalHandle
* @brief Encapsulates a state machine for a given goal that the user can
* trigger transisions on. All ROS interfaces for the goal are managed by
* trigger transitions on. All ROS interfaces for the goal are managed by
* the ActionServer to lessen the burden on the user.
"""
Expand Down
2 changes: 1 addition & 1 deletion actionlib/src/actionlib/simple_action_client.py
Original file line number Diff line number Diff line change
Expand Up @@ -97,7 +97,7 @@ def send_goal(self, goal, done_cb=None, active_cb=None, feedback_cb=None):
##
## If the goal does not complete within the execute_timeout, the goal gets preempted
##
## If preemption of the goal does not complete withing the preempt_timeout, this
## If preemption of the goal does not complete within the preempt_timeout, this
## method simply returns
##
## @param execute_timeout The time to wait for the goal to complete
Expand Down
6 changes: 3 additions & 3 deletions actionlib/src/actionlib/simple_action_server.py
Original file line number Diff line number Diff line change
Expand Up @@ -57,7 +57,7 @@ class SimpleActionServer:
## @param execute_cb Optional callback that gets called in a separate thread whenever
## a new goal is received, allowing users to have blocking callbacks.
## Adding an execute callback also deactivates the goalCallback.
## @param auto_start A boolean value that tells the ActionServer wheteher or not to start publishing as soon as it comes up. THIS SHOULD ALWAYS BE SET TO FALSE TO AVOID RACE CONDITIONS and start() should be called after construction of the server.
## @param auto_start A boolean value that tells the ActionServer whether or not to start publishing as soon as it comes up. THIS SHOULD ALWAYS BE SET TO FALSE TO AVOID RACE CONDITIONS and start() should be called after construction of the server.
def __init__(self, name, ActionSpec, execute_cb=None, auto_start=True):

self.new_goal = False
Expand Down Expand Up @@ -102,9 +102,9 @@ def __del__(self):
## @brief Accepts a new goal when one is available The status of this
## goal is set to active upon acceptance, and the status of any
## previously active goal is set to preempted. Preempts received for the
## new goal between checking if isNewGoalAvailable or invokation of a
## new goal between checking if isNewGoalAvailable or invocation of a
## goal callback and the acceptNewGoal call will not trigger a preempt
## callback. This means, isPreemptReqauested should be called after
## callback. This means, isPreemptRequested should be called after
## accepting the goal even for callback-based implementations to make
## sure the new goal does not have a pending preempt request.
## @return A shared_ptr to the new goal.
Expand Down
2 changes: 1 addition & 1 deletion actionlib/test/destruction_guard_test.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -64,7 +64,7 @@ class TestRunner : public testing::Test
cond_.notify_all();
}

// Don't destruct the protectors immeadiately. Sleep for a little bit, and then destruct.
// Don't destruct the protectors immediately. Sleep for a little bit, and then destruct.
// This will force the main thread to have to wait in it's destruct() call
printf("protecting thread is sleeping\n");
boost::this_thread::sleep(boost::posix_time::microseconds(5000000));
Expand Down
2 changes: 1 addition & 1 deletion actionlib/test/exercise_simple_client.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -27,7 +27,7 @@
* POSSIBILITY OF SUCH DAMAGE.
*/

// Derived from excercise_simple_server.py
// Derived from exercise_simple_server.py

#include <gtest/gtest.h>
#include <ros/ros.h>
Expand Down
8 changes: 4 additions & 4 deletions actionlib/test/test_ref_action_server.py
Original file line number Diff line number Diff line change
Expand Up @@ -76,7 +76,7 @@ def test_abort(self):
rospy.sleep(0.5)
self.assertEqual(g1.get_goal_status(), GoalStatus.ACTIVE) # ,"Should be active")
self.assertEqual(g2.get_goal_status(), GoalStatus.ACTIVE, "Should be active")
self.assertEqual(g3.get_goal_status(), GoalStatus.ACTIVE, "Shoule be active")
self.assertEqual(g3.get_goal_status(), GoalStatus.ACTIVE, "Should be active")
self.assertEqual(g4.get_goal_status(), GoalStatus.ACTIVE, "Should be active")

g5 = client.send_goal(goal_abort)
Expand All @@ -85,7 +85,7 @@ def test_abort(self):

self.assertEqual(g1.get_goal_status(), GoalStatus.ABORTED, "Should be aborted")
self.assertEqual(g2.get_goal_status(), GoalStatus.ABORTED, "Should be aborted")
self.assertEqual(g3.get_goal_status(), GoalStatus.ABORTED, "Shoule be aborted")
self.assertEqual(g3.get_goal_status(), GoalStatus.ABORTED, "Should be aborted")
self.assertEqual(g4.get_goal_status(), GoalStatus.ABORTED, "Should be aborted")

def test_feedback(self):
Expand All @@ -111,7 +111,7 @@ def update_feedback(id, g, f):
rospy.sleep(0.5)
self.assertEqual(g1.get_goal_status(), GoalStatus.ACTIVE, "Should be active")
self.assertEqual(g2.get_goal_status(), GoalStatus.ACTIVE, "Should be active")
self.assertEqual(g3.get_goal_status(), GoalStatus.ACTIVE, "Shoule be active")
self.assertEqual(g3.get_goal_status(), GoalStatus.ACTIVE, "Should be active")
self.assertEqual(g4.get_goal_status(), GoalStatus.ACTIVE, "Should be active")

g5 = client.send_goal(goal_feedback)
Expand Down Expand Up @@ -149,7 +149,7 @@ def test_result(self):
rospy.sleep(0.5)
self.assertEqual(g1.get_goal_status(), GoalStatus.ACTIVE, "Should be active")
self.assertEqual(g2.get_goal_status(), GoalStatus.ACTIVE, "Should be active")
self.assertEqual(g3.get_goal_status(), GoalStatus.ACTIVE, "Shoule be active")
self.assertEqual(g3.get_goal_status(), GoalStatus.ACTIVE, "Should be active")
self.assertEqual(g4.get_goal_status(), GoalStatus.ACTIVE, "Should be active")

g5 = client.send_goal(goal_result)
Expand Down

0 comments on commit 3558eb3

Please sign in to comment.