-
No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro jazzy. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 1.17.0
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version noetic-devel
Last Updated 2024-09-13
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

rospy is a pure Python client library for ROS. The rospy client API enables Python programmers to quickly interface with ROS

Additional Links

Maintainers

  • Michael Carroll
  • Shane Loretz

Authors

  • Ken Conley
  • Dirk Thomas
  • Jacob Perron
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rospy

1.17.0 (2024-09-13)

  • Stop using deprecated logger.warn (#2191)
  • Expose is_shutdown_requested in rospy module. (#2267)
  • Fix error "s is not defined" (#2328)
  • Contributors: Guglielmo Gemignani, Michael Grupp, vineet131

1.16.0 (2023-02-15)

1.15.15 (2022-11-23)

  • Move \@jacobperron from maintainer to author (#2302)
  • Add a workaround for a race condition while closing the socket (#2212) (#2233)
  • Contributors: Shane Loretz, Daniele Calisi, madmage

1.15.14 (2022-01-06)

1.15.13 (2021-09-22)

1.15.12 (2021-09-21)

  • Document current_real in timer.py (#2178)
  • Do not set self.transport unless persistent in ServiceProxy (#2171)
  • Fix #2123: Do not raise exception if socket is busy in TCPROSTransport (#2131)
  • Contributors: Kevin Chang, Shingo Kitagawa, 金梦磊

1.15.11 (2021-04-06)

1.15.10 (2021-03-18)

  • Fix "TypeError: not enough arguments for format string" (#2127)
  • Use Logger.warning() instead of the deprecated warn() (#2120)
  • Fix AttributeError isAlive (#2092)
  • Contributors: Brutus The Tschiepel, mikolajz, 金梦磊

1.15.9 (2020-10-16)

  • Update maintainers (#2075)
  • Fix spelling (#2066)
  • Fix error handling with Python 3 (#2050)
  • Contributors: Markus Grimm, Sean Yen, Shane Loretz, larslue, salihmarangoz, tomoya

1.15.8 (2020-07-23)

  • remove not existing NodeProxy from rospy __all_ (#2007)
  • fix typo in topics.py (#1977)

1.15.7 (2020-05-28)

1.15.6 (2020-05-21)

1.15.5 (2020-05-15)

1.15.4 (2020-03-19)

  • add exception for ConnectionAbortedError (#1908)
  • fix mac trying to use epoll instead of kqueue (#1907)
  • fix AttributeError: __exit_ (#1915, regression from 1.14.4)

1.15.3 (2020-02-28)

1.15.2 (2020-02-25)

1.15.1 (2020-02-24)

  • use setuptools instead of distutils (#1870)

1.15.0 (2020-02-21)

  • fix dictionary changed size during iteration (#1894)

1.14.4 (2020-02-20)

  • add default ROS_MASTER_URI (#1666)
  • bump CMake minimum version to avoid CMP0048 warning (#1869)
  • reuse xmlrpc connections everywhere (#1471)
  • use cached parameter for rosout_disable_topics_generation (#1881)
  • add args and kwargs to rospy.log* (#1289)
  • add kwargs to internal logging functions (#1290)
  • add get_param_cached (#1515)
  • more Python 3 compatibility (#1795)
  • fix line endings to be LF (#1794)
  • use condition attributes to specify Python 2 and 3 dependencies (#1792)
  • fix dynamic windowing for Topic Statistics (#1695)
  • do not raise socket exception during shutdown (#1720)
  • add possibility to pass rospy.Duration as timeout to wait_for_service and wait_for_message (#1703)
  • add is_legal_remap() to rosgraph to make remap-detection more precise (#1683)
  • add missing comma in the list of strings (#1760)
  • switch to yaml.safe_load(_all) to prevent YAMLLoadWarning (#1688)
  • fix error handling for Topic constructor (#1701)
  • make sigterm handling Python 3 compatible (#1559)
  • update wiki.ros.org URLs (#1536)
  • show connection info on rosnode info (#1497)
  • import socket, threading in udpros.py (#1494)

1.14.3 (2018-08-06)

  • maintain exception info in RosOutHandler (#1442)

1.14.2 (2018-06-06)

  • fix some errors in some probably not frequented code paths (#1415)
  • fix thread problem with get_topics() (#1416)

1.14.1 (2018-05-21)

1.14.0 (2018-05-21)

  • add API to suppress sequential identical messages (#1309)
  • add parameter to stop clients from generating rosout topics list (#1241)
  • add rosconsole echo (#1324)

1.13.6 (2018-02-05)

  • raise the correct exception from AnyMsg.serialize (#1311)
  • remove unreachable exceptions (#1260)
  • replace Thread.setDaemon() using new API (#1276)

1.13.5 (2017-11-09)

  • fix regresssion from 1.13.3 (#1224)

1.13.4 (2017-11-02)

  • fix uri in message (#1213, regression from 1.13.3)

1.13.3 (2017-10-25)

  • change rospy.Rate hz type from int to float (#1177)
  • use defined error codes rather than hardcoded integers (#1174)
  • improve log messages when waiting for service (#1026)
  • improve logger tests (#1144)

1.13.2 (2017-08-15)

  • fix stack frame identification in rospy logging (#1141, regression from 1.13.1)

1.13.1 (2017-07-27)

  • improve rospy.logXXX_throttle performance (#1091)
  • add option to reset timer when time moved backwards (#1083)
  • abort topic lookup on connection refused (#1044)
  • add rospy.logXXX_once (#1041)
  • remove "ROS time moved backwards" log message (#1027)
  • sleep in rospy wait_for_service even if exceptions raised (#1025)
  • add named loggers (#948)

1.13.0 (2017-02-22)

1.12.7 (2017-02-17)

  • make get_published_topics threadsafe (#958)
  • use poll in write_header() if available to support higher numbered fileno (#929)
  • use epoll instead of poll if available to gracefully close hung connections (#831)
  • fix Python 3 compatibility issues (#565)

1.12.6 (2016-10-26)

  • improve reconnection logic on timeout and other common errors (#851)
  • remove duplicated function (#783)

1.12.5 (2016-09-30)

1.12.4 (2016-09-19)

1.12.3 (2016-09-17)

  • raise error on rospy.init_node with None or empty node name string (#895)
  • fix wrong type in docstring for rospy.Timer (#878)
  • fix order of init and publisher in example (#873)

1.12.2 (2016-06-03)

  • add logXXX_throttle functions (#812)

1.12.1 (2016-04-18)

1.12.0 (2016-03-18)

1.11.18 (2016-03-17)

1.11.17 (2016-03-11)

  • preserve identity of numpy_msg(T) (#758)

1.11.16 (2015-11-09)

  • catch ROSInterruptException from rospy timers when shutting down (#690)

1.11.15 (2015-10-13)

  • validate name after remapping (#669)

1.11.14 (2015-09-19)

  • fix memory/thread leak with QueuedConnection (#661)
  • fix signaling already shutdown to client hooks with the appropriate signature (#651)
  • fix bug with missing current logger levels (#631)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • add rosconsole command line tool to change logger levels (#576)
  • add accessor for remaining time of the Rate class (#588)
  • fix high latency when using asynchronous publishing (#547)
  • fix error handling when publishing on Empty topic (#566)

1.11.10 (2014-12-22)

  • add specific exception for time jumping backwards (#485)
  • make param functions thread-safe (#523)
  • fix infinitely retrying subscriber (#533)
  • fix removal of QueuedConnection leading to wrong subscriber count (#526)
  • fix TCPROS header validation when [callerid]{.title-ref} header is not set (#522, regression from 1.11.1)
  • fix memory leak when using subcriber statistics (#520)
  • fix reported traffic in bytes from Python nodes (#501)

1.11.9 (2014-08-18)

  • populate delivered_msgs field of TopicStatistics message (#486)

1.11.8 (2014-08-04)

  • fix topic/connection statistics reporting code (#482)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

  • make MasterProxy thread-safe (#459)
  • check ROS_HOSTNAME for localhost / ROS_IP for 127./::1 and prevent connections from other hosts in that case ([#452 <https://github.com/ros/ros_comm/issues/452>]{.title-ref})_

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • Python 3 compatibility (#426)

1.11.3 (2014-05-21)

  • allow shutdown hooks to be any callable object (#410)
  • add demux program and related scripts (#407)
  • add publisher queue_size to rostopic

1.11.2 (2014-05-08)

  • use publisher queue_size for statistics (#398)

1.11.1 (2014-05-07)

  • improve asynchonous publishing performance (#373)
  • add warning when queue_size is omitted for rospy publisher (#346)
  • add optional topic/connection statistics (#398)
  • add transport information in SlaveAPI::getBusInfo() for roscpp & rospy (#328)
  • allow custom error handlers for services (#375)
  • add architecture_independent flag in package.xml (#391)

1.11.0 (2014-03-04)

  • fix exception handling for queued connections (#369)
  • use catkin_install_python() to install Python scripts (#361)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • implement optional queueing for rospy publications (#169)
  • overwrite __repr__ for rospy.Duration and Time (ros/genpy#24)
  • add missing dependency on roscpp

1.9.50 (2013-10-04)

  • add support for python coverage tool to work in callbacks

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

  • make rospy nodes killable while waiting for master (#262)

1.9.47 (2013-07-03)

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • add missing run_depend on python-yaml
  • allow configuration of ports for XML RPCs and TCP ROS
  • fix race condition where rospy subscribers do not connect to all publisher
  • fix closing and deregistering connection when connect fails (#128)
  • fix log level of RosOutHandler (#210)

1.9.44 (2013-03-21)

1.9.43 (2013-03-13)

1.9.42 (2013-03-08)

  • make dependencies on rospy optional by refactoring RosStreamHandler to rosgraph (#179)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

  • add colorization for rospy log output (#3691)
  • fix socket polling under Windows (#3959)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
actionlib
actionlib_tools
amr_interop_bridge
app_manager
arbotix_python
epson_imu
fam_cmd_i2c
gds_helper
gnc_visualizer
async_web_server_cpp
audibot_gazebo
sound_play
axis_camera
bagger
bondpy
calibration_estimation
capabilities
cob_android_resource_server
cob_android_script_server
cob_command_gui
cob_dashboard
cob_helper_tools
cob_monitoring
cob_script_server
generic_throttle
scenario_test_tools
service_tools
cob_description
cob_base_controller_utils
cob_cartesian_controller
cob_frame_tracker
cob_hardware_emulation
cob_model_identifier
cob_obstacle_distance
cob_twist_controller
cob_bms_driver
cob_light
cob_mimic
cob_phidget_em_state
cob_phidget_power_state
cob_phidgets
cob_relayboard
cob_sound
cob_voltage_control
cob_grasp_generation
cob_lookat_action
cob_moveit_interface
cob_obstacle_distance_moveit
cob_map_accessibility_analysis
cob_default_robot_behavior
cob_gazebo
cob_gazebo_tools
cob_gazebo_worlds
crane_x7_msgs
cras_py_common
cras_topic_tools
dataspeed_pds_rqt
dataspeed_pds_scripts
dataspeed_ulc_can
dbw_fca_can
dbw_mkz_can
dbw_polaris_can
ddynamic_reconfigure_python
depthai_examples
depthai_ros_driver
diagnostic_aggregator
diagnostic_common_diagnostics
rosdiagnostic
test_diagnostic_aggregator
dual_quaternions_ros
dynamic_reconfigure
dynamixel_sdk
end_effector
ensenso_camera
ensenso_camera_test
smach_ros
fadecandy_driver
fetch_open_auto_dock
fetch_moveit_config
flexbe_app
floam
frame_editor
franka_example_controllers
franka_gazebo
gazebo_plugins
gazebo_video_monitor_utils
tf2_py
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
gps_common
hfl_driver
ifm3d_ros_driver
camera_calibration
industrial_robot_simulator
inno_sim_interface
interactive_markers
drone_wrapper
rotors_driver
rqt_drone_teleop
rqt_ground_robot_teleop
tello_driver
joint_state_publisher
joint_state_publisher_gui
wiimote
bayesian_belief_networks
chaplus_ros
gdrive_ros
google_chat_ros
julius_ros
pgm_learner
ros_google_cloud_language
rospatlite
rostwitter
switchbot_ros
webrtcvad_ros
dynamic_tf_publisher
jsk_network_tools
multi_map_server
jsk_tools
joy_mouse
pddl_planner
jsk_perception
sound_classification
jsk_interactive
jsk_interactive_test
khi_robot_test
map_laser
leo_fw
laptop_battery_monitor
multires_image
swri_cli_tools
swri_image_util
swri_rospy
swri_transform_util
marvelmind_nav
mavros
microstrain_inertial_rqt
mikrotik_swos_tools
mir_driver
mongodb_log
mongodb_store
move_base_sequence
move_base_swp
moveit_commander
moveit_ros_planning_interface
moveit_ros_visualization
moveit_python
movie_publisher
mqtt_bridge
mrpt_graphslam_2d
fkie_master_discovery
fkie_master_sync
fkie_node_manager
fkie_node_manager_daemon
base_local_planner
fake_localization
map_server
move_base
nmea_navsat_driver
nodelet
test_nodelet_topic_tools
ntrip_client
osm_cartography
route_network
ov_eval
openni2_launch
oxford_gps_eth
pal_carbon_collector
pal_statistics
pass_through_controllers
face_detector
people_velocity_tracker
pilz_robot_programming
pilz_status_indicator_rqt
pincher_arm_bringup
pr2_position_scripts
pr2_teleop
pr2_tuckarm
pr2_dashboard_aggregator
joint_trajectory_action_tools
pr2_tuck_arms_action
ethercat_trigger_controllers
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_controller_manager
pr2_mechanism_diagnostics
pr2_move_base
pr2_power_board
imu_monitor
pr2_camera_synchronizer
pr2_computer_monitor
pr2_counterbalance_check
pr2_motor_diagnostic_tool
pr2_gazebo
pr2_gazebo_plugins
py_trees_ros
radar_pa
radar_pa_msgs
razor_imu_9dof
rc_reason_clients
locomotor
rqt_dwb_plugin
robotont_gazebo
robotont_msgs
ros_comm
test_rosbag
test_rospy
test_rosservice
rosbag
rosservice
rostest
rostopic
controller_manager
controller_manager_msgs
controller_manager_tests
rqt_controller_manager
rqt_joint_trajectory_controller
cartesian_trajectory_controller
cartesian_trajectory_interpolation
inorbit_republisher
ros_numpy
ros_pytest
rospy_tutorials
rosbag_snapshot
rosbash_params
rosapi
rosbridge_library
rosbridge_server
rosee_msg
rospilot
rospy_message_converter
rosserial_arduino
rosserial_client
rosserial_embeddedlinux
rosserial_mbed
rosserial_python
rosserial_vex_cortex
rosserial_vex_v5
rosserial_windows
rosserial_xbee
rqt_gui
rqt_gui_py
rqt_py_common
rqt_action
rqt_bag
rqt_bag_plugins
rqt_console
rqt_ez_publisher
rqt_graph
rqt_launch
rqt_logger_level
rqt_moveit
rqt_msg
rqt_nav_view
rqt_pose_view
rqt_py_console
rqt_py_trees
rqt_reconfigure
rqt_robot_dashboard
rqt_robot_monitor
rqt_runtime_monitor
rqt_srv
rqt_tf_tree
rqt_top
rqt_web
rtabmap_python
rviz
rx_service_tools
schunk_simulated_tactile_sensors
sciurus17_control
sciurus17_msgs
sciurus17_vision
sensehat_ros
sick_scan
snmp_ros
static_transform_mux
swri_profiler
teleop_legged_robots
joy_teleop
key_teleop
mouse_teleop
teleop_twist_keyboard
tf2_client
tf2_server
tf2_web_republisher
timed_roslaunch
trac_ik_python
turtlebot3_example
turtlebot3_teleop
tuw_geometry
tuw_gazebo_msgs
tuw_geometry_msgs
tuw_nav_msgs
tuw_vehicle_msgs
twist_mux
uavcan_communicator
ublox_msg_filters
ubnt_airos_tools
unique_id
ur_kinematics
urdfdom_py
vda5050_connector
video_stream_opencv
visp_tracker
visp_ros
rwt_image_view
rwt_moveit
rwt_plot
volta_description
webots_ros
wge100_camera
wge100_camera_firmware
wifi_ddwrt
wireless_watcher
easy_markers
joy_listener
kalman_filter
rosbaglive
z_laser_gui
z_laser_viz
z_laser_zlp1
darknet_ros
oled_display_node
rqt_pr2_dashboard
flexbe_core
flexbe_input
flexbe_mirror
flexbe_msgs
flexbe_onboard
flexbe_states
flexbe_testing
flexbe_widget
sick_scan_xd
slider_publisher
system_fingerprint
grepros
massrobotics_amr_sender
atf_core
atf_metrics
atf_plotter
atf_recorder_plugins
atf_test
atf_test_tools
cam2lidar
node_monitoring
ros_monitoring
clearpath_onav_api_examples_lib
cob_fiducials
magnetometer_pipeline
cras_joy_tools
electronic_io
boeing_gazebo_model_attachment_plugin
gnss_info
imu_from_ios_sensorlog
l3cam_ros
leo_example_line_follower
leo_example_object_detection
line_planner
monkeywrench
nicla_vision_ros
pyhri
quori_arm_controller
raspimouse_control
rocky_tf_monitor
rose2
serl_franka_controllers
snmp_diagnostics
thunder_line_follower_pmr3100
vizanti
ros_vosk
wrapyfi_ros_interfaces

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rospy at Robotics Stack Exchange

No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.
No version for distro eloquent. Known supported distros are highlighted in the buttons above.
No version for distro dashing. Known supported distros are highlighted in the buttons above.
No version for distro galactic. Known supported distros are highlighted in the buttons above.
No version for distro foxy. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 1.13.7
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version lunar-devel
Last Updated 2019-02-01
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

rospy is a pure Python client library for ROS. The rospy client API enables Python programmers to quickly interface with ROS

Additional Links

Maintainers

  • Dirk Thomas

Authors

  • Ken Conley
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rospy

1.13.7 (2018-08-17)

  • fix some errors in some probably not frequented code paths (#1415)
  • fix thread problem with get_topics() (#1416)
  • add rosconsole echo (#1324)

1.13.6 (2018-02-05)

  • raise the correct exception from AnyMsg.serialize (#1311)
  • remove unreachable exceptions (#1260)
  • replace Thread.setDaemon() using new API (#1276)

1.13.5 (2017-11-09)

  • fix regresssion from 1.13.3 (#1224)

1.13.4 (2017-11-02)

  • fix uri in message (#1213, regression from 1.13.3)

1.13.3 (2017-10-25)

  • change rospy.Rate hz type from int to float (#1177)
  • use defined error codes rather than hardcoded integers (#1174)
  • improve log messages when waiting for service (#1026)
  • improve logger tests (#1144)

1.13.2 (2017-08-15)

  • fix stack frame identification in rospy logging (#1141, regression from 1.13.1)

1.13.1 (2017-07-27)

  • improve rospy.logXXX_throttle performance (#1091)
  • add option to reset timer when time moved backwards (#1083)
  • abort topic lookup on connection refused (#1044)
  • add rospy.logXXX_once (#1041)
  • remove "ROS time moved backwards" log message (#1027)
  • sleep in rospy wait_for_service even if exceptions raised (#1025)
  • add named loggers (#948)

1.13.0 (2017-02-22)

1.12.7 (2017-02-17)

  • make get_published_topics threadsafe (#958)
  • use poll in write_header() if available to support higher numbered fileno (#929)
  • use epoll instead of poll if available to gracefully close hung connections (#831)
  • fix Python 3 compatibility issues (#565)

1.12.6 (2016-10-26)

  • improve reconnection logic on timeout and other common errors (#851)
  • remove duplicated function (#783)

1.12.5 (2016-09-30)

1.12.4 (2016-09-19)

1.12.3 (2016-09-17)

  • raise error on rospy.init_node with None or empty node name string (#895)
  • fix wrong type in docstring for rospy.Timer (#878)
  • fix order of init and publisher in example (#873)

1.12.2 (2016-06-03)

  • add logXXX_throttle functions (#812)

1.12.1 (2016-04-18)

1.12.0 (2016-03-18)

1.11.18 (2016-03-17)

1.11.17 (2016-03-11)

  • preserve identity of numpy_msg(T) (#758)

1.11.16 (2015-11-09)

  • catch ROSInterruptException from rospy timers when shutting down (#690)

1.11.15 (2015-10-13)

  • validate name after remapping (#669)

1.11.14 (2015-09-19)

  • fix memory/thread leak with QueuedConnection (#661)
  • fix signaling already shutdown to client hooks with the appropriate signature (#651)
  • fix bug with missing current logger levels (#631)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • add rosconsole command line tool to change logger levels (#576)
  • add accessor for remaining time of the Rate class (#588)
  • fix high latency when using asynchronous publishing (#547)
  • fix error handling when publishing on Empty topic (#566)

1.11.10 (2014-12-22)

  • add specific exception for time jumping backwards (#485)
  • make param functions thread-safe (#523)
  • fix infinitely retrying subscriber (#533)
  • fix removal of QueuedConnection leading to wrong subscriber count (#526)
  • fix TCPROS header validation when [callerid]{.title-ref} header is not set (#522, regression from 1.11.1)
  • fix memory leak when using subcriber statistics (#520)
  • fix reported traffic in bytes from Python nodes (#501)

1.11.9 (2014-08-18)

  • populate delivered_msgs field of TopicStatistics message (#486)

1.11.8 (2014-08-04)

  • fix topic/connection statistics reporting code (#482)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

  • make MasterProxy thread-safe (#459)
  • check ROS_HOSTNAME for localhost / ROS_IP for 127./::1 and prevent connections from other hosts in that case ([#452 <https://github.com/ros/ros_comm/issues/452>]{.title-ref})_

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • Python 3 compatibility (#426)

1.11.3 (2014-05-21)

  • allow shutdown hooks to be any callable object (#410)
  • add demux program and related scripts (#407)
  • add publisher queue_size to rostopic

1.11.2 (2014-05-08)

  • use publisher queue_size for statistics (#398)

1.11.1 (2014-05-07)

  • improve asynchonous publishing performance (#373)
  • add warning when queue_size is omitted for rospy publisher (#346)
  • add optional topic/connection statistics (#398)
  • add transport information in SlaveAPI::getBusInfo() for roscpp & rospy (#328)
  • allow custom error handlers for services (#375)
  • add architecture_independent flag in package.xml (#391)

1.11.0 (2014-03-04)

  • fix exception handling for queued connections (#369)
  • use catkin_install_python() to install Python scripts (#361)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • implement optional queueing for rospy publications (#169)
  • overwrite __repr__ for rospy.Duration and Time (ros/genpy#24)
  • add missing dependency on roscpp

1.9.50 (2013-10-04)

  • add support for python coverage tool to work in callbacks

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

  • make rospy nodes killable while waiting for master (#262)

1.9.47 (2013-07-03)

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • add missing run_depend on python-yaml
  • allow configuration of ports for XML RPCs and TCP ROS
  • fix race condition where rospy subscribers do not connect to all publisher
  • fix closing and deregistering connection when connect fails (#128)
  • fix log level of RosOutHandler (#210)

1.9.44 (2013-03-21)

1.9.43 (2013-03-13)

1.9.42 (2013-03-08)

  • make dependencies on rospy optional by refactoring RosStreamHandler to rosgraph (#179)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

  • add colorization for rospy log output (#3691)
  • fix socket polling under Windows (#3959)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
actionlib
app_manager
ar_track_alvar
arbotix_python
sound_play
axis_camera
bondpy
calibration_estimation
camera_info_manager_py
capabilities
ddynamic_reconfigure_python
diagnostic_aggregator
diagnostic_common_diagnostics
rosdiagnostic
test_diagnostic_aggregator
dynamic_reconfigure
ensenso_camera
ensenso_camera_test
smach_ros
find_object_2d
flexbe_core
flexbe_input
flexbe_mirror
flexbe_msgs
flexbe_onboard
flexbe_states
flexbe_testing
flexbe_widget
flexbe_app
frame_editor
franka_example_controllers
panda_moveit_config
gazebo_plugins
generic_control_toolbox
tf2_py
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
gps_common
camera_calibration
interactive_markers
joint_state_publisher
joint_state_publisher_gui
ps3joy
wiimote
bayesian_belief_networks
chaplus_ros
gdrive_ros
google_chat_ros
julius_ros
pgm_learner
ros_google_cloud_language
rospatlite
rostwitter
switchbot_ros
webrtcvad_ros
map_laser
access_point_control
asmach_tutorials
ddwrt_access_point
hostapd_access_point
linksys_access_point
multi_interface_roam
network_monitor_udp
network_traffic_control
swri_cli_tools
swri_image_util
swri_rospy
swri_transform_util
mavros
mir_driver
moveit_commander
moveit_ros_planning_interface
moveit_ros_visualization
moveit_python
mqtt_bridge
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_graphslam_2d
mrpt_icp_slam_2d
mrpt_rbpf_slam
base_local_planner
fake_localization
map_server
move_base
nodelet
test_nodelet_topic_tools
novatel_span_driver
omronsentech_camera
osm_cartography
route_network
openni2_launch
face_detector
people_velocity_tracker
pr2_position_scripts
pr2_teleop
pr2_tuckarm
pr2_dashboard_aggregator
joint_trajectory_action_tools
pr2_tuck_arms_action
ethercat_trigger_controllers
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_controller_manager
pr2_mechanism_diagnostics
pr2_power_board
pr2_gazebo
pr2_gazebo_plugins
pyros_test
radar_omnipresense
realtime_tools
locomotor
ros_comm
test_rosbag
test_rospy
test_rosservice
rosbag
rosservice
rostest
rostopic
rqt_joint_trajectory_controller
rospy_tutorials
rosbash_params
rospy_message_converter
rosserial_arduino
rosserial_client
rosserial_embeddedlinux
rosserial_mbed
rosserial_python
rosserial_vex_cortex
rosserial_vex_v5
rosserial_windows
rosserial_xbee
rqt_gui
rqt_gui_py
rqt_py_common
rqt_action
rqt_bag
rqt_bag_plugins
rqt_console
rqt_ez_publisher
rqt_graph
rqt_launch
rqt_logger_level
rqt_moveit
rqt_msg
rqt_nav_view
rqt_pose_view
rqt_py_console
rqt_reconfigure
rqt_robot_dashboard
rqt_robot_monitor
rqt_runtime_monitor
rqt_srv
rqt_tf_tree
rqt_top
rqt_web
rtabmap_ros
rviz
sick_scan
static_tf
static_transform_mux
teleop_keyboard_omni3
joy_teleop
key_teleop
mouse_teleop
teleop_twist_keyboard
tf2_web_republisher
trac_ik_python
unique_id
uuv_assistants
uuv_control_cascaded_pid
uuv_control_utils
uuv_thruster_manager
uuv_trajectory_control
uuv_teleop
video_stream_opencv
visp_tracker
webots_ros
wifi_ddwrt
easy_markers
joy_listener
kalman_filter
rosbaglive
xsens_driver
innok_heros_driver
iot_bridge
pyros_utils

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rospy at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.11.21
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-03-06
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

rospy is a pure Python client library for ROS. The rospy client API enables Python programmers to quickly interface with ROS

Additional Links

Maintainers

  • Dirk Thomas

Authors

  • Ken Conley
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rospy

1.11.21 (2017-03-06)

  • make get_published_topics threadsafe (#958)
  • fix wrong type in docstring for rospy.Timer (#878)
  • add logXXX_throttle functions (#812)

1.11.20 (2016-06-27)

1.11.19 (2016-04-18)

1.11.18 (2016-03-17)

1.11.17 (2016-03-11)

  • preserve identity of numpy_msg(T) (#758)

1.11.16 (2015-11-09)

  • catch ROSInterruptException from rospy timers when shutting down (#690)

1.11.15 (2015-10-13)

  • validate name after remapping (#669)

1.11.14 (2015-09-19)

  • fix memory/thread leak with QueuedConnection (#661)
  • fix signaling already shutdown to client hooks with the appropriate signature (#651)
  • fix bug with missing current logger levels (#631)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • add rosconsole command line tool to change logger levels (#576)
  • add accessor for remaining time of the Rate class (#588)
  • fix high latency when using asynchronous publishing (#547)
  • fix error handling when publishing on Empty topic (#566)

1.11.10 (2014-12-22)

  • add specific exception for time jumping backwards (#485)
  • make param functions thread-safe (#523)
  • fix infinitely retrying subscriber (#533)
  • fix removal of QueuedConnection leading to wrong subscriber count (#526)
  • fix TCPROS header validation when [callerid]{.title-ref} header is not set (#522, regression from 1.11.1)
  • fix memory leak when using subcriber statistics (#520)
  • fix reported traffic in bytes from Python nodes (#501)

1.11.9 (2014-08-18)

  • populate delivered_msgs field of TopicStatistics message (#486)

1.11.8 (2014-08-04)

  • fix topic/connection statistics reporting code (#482)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

  • make MasterProxy thread-safe (#459)
  • check ROS_HOSTNAME for localhost / ROS_IP for 127./::1 and prevent connections from other hosts in that case ([#452 <https://github.com/ros/ros_comm/issues/452>]{.title-ref})_

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • Python 3 compatibility (#426)

1.11.3 (2014-05-21)

  • allow shutdown hooks to be any callable object (#410)
  • add demux program and related scripts (#407)
  • add publisher queue_size to rostopic

1.11.2 (2014-05-08)

  • use publisher queue_size for statistics (#398)

1.11.1 (2014-05-07)

  • improve asynchonous publishing performance (#373)
  • add warning when queue_size is omitted for rospy publisher (#346)
  • add optional topic/connection statistics (#398)
  • add transport information in SlaveAPI::getBusInfo() for roscpp & rospy (#328)
  • allow custom error handlers for services (#375)
  • add architecture_independent flag in package.xml (#391)

1.11.0 (2014-03-04)

  • fix exception handling for queued connections (#369)
  • use catkin_install_python() to install Python scripts (#361)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • implement optional queueing for rospy publications (#169)
  • overwrite __repr__ for rospy.Duration and Time (ros/genpy#24)
  • add missing dependency on roscpp

1.9.50 (2013-10-04)

  • add support for python coverage tool to work in callbacks

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

  • make rospy nodes killable while waiting for master (#262)

1.9.47 (2013-07-03)

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • add missing run_depend on python-yaml
  • allow configuration of ports for XML RPCs and TCP ROS
  • fix race condition where rospy subscribers do not connect to all publisher
  • fix closing and deregistering connection when connect fails (#128)
  • fix log level of RosOutHandler (#210)

1.9.44 (2013-03-21)

1.9.43 (2013-03-13)

1.9.42 (2013-03-08)

  • make dependencies on rospy optional by refactoring RosStreamHandler to rosgraph (#179)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

  • add colorization for rospy log output (#3691)
  • fix socket polling under Windows (#3959)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
actionlib
ar_track_alvar
arbotix_python
async_web_server_cpp
sound_play
bondpy
calibration_estimation
camera_info_manager_py
diagnostic_aggregator
diagnostic_common_diagnostics
rosdiagnostic
test_diagnostic_aggregator
dynamic_reconfigure
smach_ros
fetch_moveit_config
gazebo_plugins
tf2_py
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
gps_common
camera_calibration
industrial_robot_simulator
interactive_markers
ps3joy
wiimote
bayesian_belief_networks
chaplus_ros
gdrive_ros
google_chat_ros
julius_ros
pgm_learner
ros_google_cloud_language
rospatlite
rostwitter
switchbot_ros
webrtcvad_ros
dynamic_tf_publisher
jsk_network_tools
multi_map_server
jsk_tools
joy_mouse
pddl_planner
jsk_perception
sound_classification
jsk_interactive
jsk_interactive_test
map_laser
leap_motion
swri_cli_tools
swri_image_util
swri_rospy
swri_transform_util
mavros
md49_base_controller
mongodb_log
mongodb_store
moveit_commander
moveit_ros_planning_interface
moveit_ros_visualization
moveit_python
mrpt_graphslam_2d
default_cfg_fkie
master_discovery_fkie
master_sync_fkie
node_manager_fkie
base_local_planner
fake_localization
map_server
move_base
range_sensor_layer
nmea_navsat_driver
nodelet
test_nodelet_topic_tools
novatel_span_driver
openni2_launch
face_detector
people_velocity_tracker
pr2_dashboard_aggregator
ethercat_trigger_controllers
pr2_mechanism_controllers
robot_mechanism_controllers
pr2_controller_manager
pr2_mechanism_diagnostics
pyros_test
razor_imu_9dof
realtime_tools
ros_comm
test_rosbag
test_rospy
test_rosservice
rosbag
rosservice
rostest
rostopic
rqt_joint_trajectory_controller
ros_numpy
rospy_tutorials
rospilot
rospy_message_converter
rosserial_arduino
rosserial_client
rosserial_embeddedlinux
rosserial_mbed
rosserial_python
rosserial_vex_cortex
rosserial_vex_v5
rosserial_windows
rosserial_xbee
rotors_evaluation
rqt_rotors
rqt_gui_py
rqt_py_common
rqt_action
rqt_bag
rqt_bag_plugins
rqt_console
rqt_ez_publisher
rqt_graph
rqt_launch
rqt_launchtree
rqt_logger_level
rqt_moveit
rqt_msg
rqt_nav_view
rqt_pose_view
rqt_py_console
rqt_reconfigure
rqt_robot_dashboard
rqt_robot_monitor
rqt_runtime_monitor
rqt_srv
rqt_tf_tree
rqt_top
rqt_web
rtabmap_ros
rosnode_rtc
rviz
joy_teleop
key_teleop
mouse_teleop
teleop_twist_keyboard
tf2_web_republisher
trac_ik_python
twist_mux
ublox_msg_filters
underwater_vehicle_dynamics
unique_id
acc_finder
battery_guard
move_base_straight
rgbd_rosbag_tools
simple_approximate_time_synchronizer
tf_publisher_gui
video_stream_opencv
visp_tracker
visp_ros
rwt_image_view
rwt_moveit
rwt_plot
wireless_watcher
catkinize_this
easy_markers
joy_listener
kalman_filter
manifest_cleaner
rosbaglive
roswiki_node
xsens_driver
dynamixel_controllers
dynamixel_driver
geonav_transform
grizzly_description
grizzly_teleop
hector_exploration_controller
hector_exploration_planner
hector_gps_calibration
hector_timestamp_alignment
hector_heat_detection
hector_motion_detection
hector_co2_detection_plugin
tracker_base_ui
innok_heros_driver
korg_nanokontrol
lyap_control
nao_dcm_bringup
nao_audio
nao_vision
nao_apps
naoqi_driver_py
naoqi_navigation
naoqi_pose
naoqi_sensors_py
naoqi_dcm_driver
pepper_dcm_bringup
pepper_sensors_py
pioneer_bringup
pioneer_teleop
pyros_interfaces_ros
pyros_utils
joint_state_publisher
romeo_sensors_py
rsv_balance_rqt
schunk_svh_driver
uavc_v4lctl
vigir_footstep_planning_lib
vigir_footstep_planning_widgets
vigir_feet_pose_generator
vigir_foot_pose_transformer
vigir_footstep_planner
vigir_global_footstep_planner
vigir_walk_monitor
vigir_footstep_planning_msgs
vigir_pluginlib_manager
vigir_step_control
head_pose_estimation
pocketsphinx
roboteq_diagnostics
rosh
roshlaunch
rosh_common
rosh_geometry
rospeex_core
rospeex_if
rospeex_samples
rospeex_webaudiomonitor
arni_gui
arni_nodeinterface
arni_processing
arni_rqt_detail_plugin
arni_rqt_overview_plugin
aubo_control
aubo_new_driver
aubo_panel
battery_monitor_rmp
behavior_tree_core
behavior_tree_leaves
ros_ethernet_rmp
rplidar_python
rwt_config_generator
simple_voice
heatmap
pyros_msgs
rsync_ros

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rospy at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.11.21
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-03-06
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

rospy is a pure Python client library for ROS. The rospy client API enables Python programmers to quickly interface with ROS

Additional Links

Maintainers

  • Dirk Thomas

Authors

  • Ken Conley
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rospy

1.11.21 (2017-03-06)

  • make get_published_topics threadsafe (#958)
  • fix wrong type in docstring for rospy.Timer (#878)
  • add logXXX_throttle functions (#812)

1.11.20 (2016-06-27)

1.11.19 (2016-04-18)

1.11.18 (2016-03-17)

1.11.17 (2016-03-11)

  • preserve identity of numpy_msg(T) (#758)

1.11.16 (2015-11-09)

  • catch ROSInterruptException from rospy timers when shutting down (#690)

1.11.15 (2015-10-13)

  • validate name after remapping (#669)

1.11.14 (2015-09-19)

  • fix memory/thread leak with QueuedConnection (#661)
  • fix signaling already shutdown to client hooks with the appropriate signature (#651)
  • fix bug with missing current logger levels (#631)

1.11.13 (2015-04-28)

1.11.12 (2015-04-27)

1.11.11 (2015-04-16)

  • add rosconsole command line tool to change logger levels (#576)
  • add accessor for remaining time of the Rate class (#588)
  • fix high latency when using asynchronous publishing (#547)
  • fix error handling when publishing on Empty topic (#566)

1.11.10 (2014-12-22)

  • add specific exception for time jumping backwards (#485)
  • make param functions thread-safe (#523)
  • fix infinitely retrying subscriber (#533)
  • fix removal of QueuedConnection leading to wrong subscriber count (#526)
  • fix TCPROS header validation when [callerid]{.title-ref} header is not set (#522, regression from 1.11.1)
  • fix memory leak when using subcriber statistics (#520)
  • fix reported traffic in bytes from Python nodes (#501)

1.11.9 (2014-08-18)

  • populate delivered_msgs field of TopicStatistics message (#486)

1.11.8 (2014-08-04)

  • fix topic/connection statistics reporting code (#482)

1.11.7 (2014-07-18)

1.11.6 (2014-07-10)

  • make MasterProxy thread-safe (#459)
  • check ROS_HOSTNAME for localhost / ROS_IP for 127./::1 and prevent connections from other hosts in that case ([#452 <https://github.com/ros/ros_comm/issues/452>]{.title-ref})_

1.11.5 (2014-06-24)

1.11.4 (2014-06-16)

  • Python 3 compatibility (#426)

1.11.3 (2014-05-21)

  • allow shutdown hooks to be any callable object (#410)
  • add demux program and related scripts (#407)
  • add publisher queue_size to rostopic

1.11.2 (2014-05-08)

  • use publisher queue_size for statistics (#398)

1.11.1 (2014-05-07)

  • improve asynchonous publishing performance (#373)
  • add warning when queue_size is omitted for rospy publisher (#346)
  • add optional topic/connection statistics (#398)
  • add transport information in SlaveAPI::getBusInfo() for roscpp & rospy (#328)
  • allow custom error handlers for services (#375)
  • add architecture_independent flag in package.xml (#391)

1.11.0 (2014-03-04)

  • fix exception handling for queued connections (#369)
  • use catkin_install_python() to install Python scripts (#361)

1.10.0 (2014-02-11)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • implement optional queueing for rospy publications (#169)
  • overwrite __repr__ for rospy.Duration and Time (ros/genpy#24)
  • add missing dependency on roscpp

1.9.50 (2013-10-04)

  • add support for python coverage tool to work in callbacks

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

  • make rospy nodes killable while waiting for master (#262)

1.9.47 (2013-07-03)

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • add missing run_depend on python-yaml
  • allow configuration of ports for XML RPCs and TCP ROS
  • fix race condition where rospy subscribers do not connect to all publisher
  • fix closing and deregistering connection when connect fails (#128)
  • fix log level of RosOutHandler (#210)

1.9.44 (2013-03-21)

1.9.43 (2013-03-13)

1.9.42 (2013-03-08)

  • make dependencies on rospy optional by refactoring RosStreamHandler to rosgraph (#179)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

  • add colorization for rospy log output (#3691)
  • fix socket polling under Windows (#3959)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
actionlib
app_manager
ar_track_alvar
arbotix_python
asr_cyberglove_lib
asr_cyberglove_visualization
asr_mild_base_fake_driving
asr_mild_base_launch_files
asr_object_database
async_web_server_cpp
ati_force_torque
sound_play
axis_camera
bondpy
calibration_estimation
camera_info_manager_py
capabilities
cob_android_resource_server
cob_android_script_server
cob_command_gui
cob_dashboard
cob_helper_tools
cob_monitoring
cob_script_server
generic_throttle
scenario_test_tools
service_tools
cob_description
cob_cartesian_controller
cob_frame_tracker
cob_model_identifier
cob_obstacle_distance
cob_twist_controller
cob_bms_driver
cob_camera_sensors
cob_light
cob_phidget_em_state
cob_phidget_power_state
cob_phidgets
cob_relayboard
cob_sound
cob_voltage_control
cob_grasp_generation
cob_lookat_action
cob_moveit_interface
cob_obstacle_distance_moveit
cob_pick_place_action
cob_map_accessibility_analysis
cob_default_robot_behavior
cob_bringup_sim
cob_gazebo
cob_gazebo_worlds
dataspeed_ulc_can
ddynamic_reconfigure_python
diagnostic_aggregator
diagnostic_common_diagnostics
rosdiagnostic
test_diagnostic_aggregator
dynamic_reconfigure
dynamixel_sdk
smach_ros
fetchit_challenge
fetch_moveit_config
flexbe_core
flexbe_input
flexbe_mirror
flexbe_msgs
flexbe_onboard
flexbe_states
flexbe_testing
flexbe_widget
flexbe_app
flir_ptu_driver
frame_editor
gazebo_plugins
generic_control_toolbox
tf2_py
tf2_ros
tf2_sensor_msgs
turtle_tf
turtle_tf2
gps_common
camera_calibration
industrial_robot_simulator
interactive_markers
joint_state_publisher
ps3joy
wiimote
bayesian_belief_networks
chaplus_ros
gdrive_ros
google_chat_ros
julius_ros
pgm_learner
ros_google_cloud_language
rospatlite
rostwitter
switchbot_ros
webrtcvad_ros
dynamic_tf_publisher
jsk_network_tools
multi_map_server
jsk_tools
joy_mouse
pddl_planner
jsk_perception
sound_classification
jsk_interactive
jsk_interactive_test
kobuki_auto_docking
kobuki_node
kobuki_dashboard
kobuki_qtestsuite
map_laser
leap_motion
access_point_control
asmach_tutorials
ddwrt_access_point
hostapd_access_point
linksys_access_point
multi_interface_roam
network_monitor_udp
network_traffic_control
swri_cli_tools
swri_image_util
swri_rospy
swri_transform_util
marvelmind_nav
mavros
md49_base_controller
mir_driver
ml_classifiers
mongodb_log
mongodb_store
moveit_commander
moveit_ros_planning_interface
moveit_ros_visualization
moveit_python
movie_publisher
mrp2_analyzer
mrp2_display
mrp2_hardware
mrpt_graphslam_2d
default_cfg_fkie
master_discovery_fkie
master_sync_fkie
node_manager_fkie
base_local_planner
fake_localization
map_server
move_base
range_sensor_layer
nmea_navsat_driver
nodelet
test_nodelet_topic_tools
novatel_span_driver
osm_cartography
route_network
openni2_launch
face_detector
people_velocity_tracker
pr2_position_scripts
pr2_teleop
pr2_tuckarm
pr2_calibration_launch
pr2_dashboard_aggregator
joint_trajectory_action_tools
pr2_tuck_arms_action
ethercat_trigger_controllers
pr2_mechanism_controllers
robot_mechanism_controllers
fingertip_pressure
pr2_controller_manager
pr2_mechanism_diagnostics
pr2_move_base
pr2_power_board
imu_monitor
pr2_camera_synchronizer
pr2_computer_monitor
pr2_counterbalance_check
pr2_motor_diagnostic_tool
pr2_gazebo
pr2_gazebo_plugins
pyros_test
raspimouse_control
razor_imu_9dof
realtime_tools
locomotor
rocon_service_pair_msgs
rocon_interactions
rocon_launch
rocon_master_info
rocon_python_comms
rocon_python_utils
rocon_uri
ros_comm
test_rosbag
test_rospy
test_rosservice
rosbag
rosservice
rostest
rostopic
rqt_joint_trajectory_controller
ros_numpy
rospy_tutorials
rosbash_params
rosapi
rosbridge_library
rosbridge_server
rospilot
rospy_message_converter
rosserial_arduino
rosserial_client
rosserial_embeddedlinux
rosserial_python
rosserial_windows
rosserial_xbee
rotors_evaluation
rqt_rotors
rqt_gui_py
rqt_py_common
rqt_action
rqt_bag
rqt_bag_plugins
rqt_console
rqt_ez_publisher
rqt_graph
rqt_joint_trajectory_plot
rqt_launch
rqt_launchtree
rqt_logger_level
rqt_moveit
rqt_msg
rqt_nav_view
rqt_pose_view
rqt_py_console
rqt_reconfigure
rqt_robot_dashboard
rqt_robot_monitor
rqt_runtime_monitor
rqt_srv
rqt_tf_tree
rqt_top
rqt_web
rtabmap_ros
rosnode_rtc
hironx_ros_bridge
rviz
schunk_simulated_tactile_sensors
sick_scan
sr_edc_muscle_tools
sr_robot_lib
sr_gui_advanced_controls
sr_gui_biotac
sr_gui_bootloader
sr_gui_change_muscle_controllers
sr_gui_cyberglove_calibrator
sr_gui_movement_recorder
sr_gui_muscle_driver_bootloader
sr_gui_self_test
sr_gui_controller_tuner
sr_gui_hand_calibration
sr_gui_motor_resetter
sr_gui_state_saver
sr_gui_change_controllers
sr_gui_grasp_controller
sr_gui_joint_slider
static_tf
static_transform_mux
swri_profiler
teleop_keyboard_omni3
joy_teleop
key_teleop
mouse_teleop
teleop_twist_keyboard
tf2_web_republisher
timed_roslaunch
trac_ik_python
ublox_msg_filters
underwater_vehicle_dynamics
unique_id
ur_driver
acc_finder
battery_guard
move_base_straight
rgbd_rosbag_tools
simple_approximate_time_synchronizer
tf_publisher_gui
video_stream_opencv
visp_tracker
visp_ros
rwt_image_view
rwt_moveit
rwt_plot
warehouse_ros
wge100_camera
wge100_camera_firmware
wifi_ddwrt
wireless_watcher
catkinize_this
easy_markers
joy_listener
kalman_filter
manifest_cleaner
rosbaglive
roswiki_node
xsens_driver
yocs_ar_pair_approach
yocs_localization_manager
yocs_navigator
yocs_virtual_sensor
bhand_controller
declination
dynamixel_controllers
dynamixel_driver
geonav_transform
grizzly_description
grizzly_teleop
hector_exploration_controller
hector_exploration_planner
hector_gps_calibration
hector_timestamp_alignment
hector_heat_detection
hector_motion_detection
hector_co2_detection_plugin
tracker_base_ui
footstep_planner
innok_heros_driver
korg_nanokontrol
kuka_rsi_simulator
lyap_control
app1
app2
app3
gazebo_flocking
app_loader
micros_swarm
opensplice_dds_broker
ros_broker
udp_bc_broker
olfati_saber_flocking
pso
test_statistic
testbb
testnc
testrth
testscdspso
testvstig
micros_swarm_stage
muse_bldc_motor_drive
nao_dcm_bringup
nao_audio
nao_vision
nao_apps
naoqi_driver_py
naoqi_navigation
naoqi_pose
naoqi_sensors_py
naoqi_dcm_driver
oculusprime
shape_reconstruction
shape_tracker
openrave_actionlib
openrave_calibration
openraveros_tutorials
packml_gui
pepper_dcm_bringup
pepper_sensors_py
pheeno_ros
pheeno_ros_sim
phoxi_camera
pioneer_bringup
pioneer_teleop
pyros_interfaces_ros
pyros_utils
rbcar_twist2ack
robotiq_c_model_control
robotiq_modbus_rtu
robotiq_modbus_tcp
robotiq_s_model_control
roch_bringup
rocon_app_manager
rocon_apps
rocon_gateway
rocon_gateway_tests
rocon_hub_client
rocon_test
romeo_sensors_py
ros_explorer
ros_opcua_impl_freeopcua
ros_opcua_impl_python_opcua
rosabridge_arduino
rqt_pr2_dashboard
rrt_exploration
schunk_svh_driver
bag_tools
launch_tools
plot_tools
thingmagic_usbpro
turtlebot_calibration
turtlebot_arm_moveit_demos
create_node
create_dashboard
uavc_v4lctl
vigir_footstep_planning_lib
vigir_footstep_planning_widgets
vigir_feet_pose_generator
vigir_foot_pose_transformer
vigir_footstep_planner
vigir_global_footstep_planner
vigir_walk_monitor
vigir_footstep_planning_msgs
vigir_pluginlib_manager
vigir_step_control
waypoint_generator
waypoint_touring
image_stream
launchman
rosjson
rosweb
webui
world_canvas_server
world_canvas_client_py
world_canvas_utils
explorer
argos3d_p100
baxter_examples
baxter_interface
baxter_tools
bwi_logging
bwi_planning_common
bwi_rqt_plugins
bwi_tasks
multi_level_map_server
multi_level_map_utils
stop_base
cob_leg_detection
concert_resource_pool
concert_scheduler_requests
concert_simple_scheduler
darwin_gazebo
gazebo2rviz
head_pose_estimation
household_objects_database
jsk_fetch_diagnosis
nao_jsk_teleop
jsk_panda_teleop
jsk_robot_startup
imu_recalibration
map_store
phantomx_gazebo
pi_tracker
pi_trees_lib
pi_trees_ros
pocketsphinx
pr2_joint_teleop
pr2_simple_interface
program_queue
slider_gui
pr2_precise_trajectory
pr2_props_app
pysdf
roboteq_diagnostics
concert_conductor
concert_master
concert_schedulers
concert_service_link_graph
concert_service_manager
concert_service_utilities
concert_software_farmer
concert_utilities
rosR
ros_arduino_python
rosh
roshlaunch
rosh_common
rosh_geometry
rospeex_core
rospeex_if
rospeex_samples
rospeex_webaudiomonitor
rqt_capabilities
segbot_gui
segbot_sensors
sentis_tof_m100
skeleton_markers
sr_ronex_examples
sr_ronex_test
airbus_cobot_gui
airbus_docgen
airbus_plugin_log_manager
airbus_plugin_node_manager
airbus_plugin_rqt
airbus_plugin_rviz
airbus_pyqt_extend
airbus_ssm_core
airbus_ssm_tutorial
alfred_sr_linux
ardrone2islab
arni_gui
arni_nodeinterface
arni_processing
arni_rqt_detail_plugin
arni_rqt_overview_plugin
aubo_control
aubo_new_driver
aubo_panel
battery_monitor_rmp
baxter_sim_examples
behavior_tree_core
behavior_tree_leaves
bowpmap_ros
loki_base_node
cassandra_ros
concert_service_admin
concert_service_gazebo
concert_service_image_stream
concert_service_indoor_2d_map_prep
concert_service_teleop
concert_service_turtlesim
concert_service_waypoint_navigation
dji_sdk
dji_sdk_dji2mav
dji_ronin
drums_ros
evarobot_state_publisher
evarobot_gazebo
face_recognition
fetch_arm_control
fetch_pbd_interaction
fetch_social_gaze
firos
forte_rc_cloud
forte_rc_description
forte_rc_mapping_slam
forte_rc_teleop
fulanghua_evaluator
fulanghua_static_path_publisher
gaitech_edu
grasp_synergy
hexagon_map
target_object_detector
ihmc_ros_diagnostics
im_msgs
innok_heros_lights
selective_dualarm_stowing
sphand_driver
jsk_2015_05_baxter_apc
jsk_arc2017_baxter
jsk_arc2017_common
elevator_move_base_pr2
drc_com_common
drc_task_common
gazebo_drive_simulator
scratch3-ros
kml_util
kobuki_led_controller
lama_interfaces
anj_featurenav
dfs_explorer
light_scan_sim
lower_step_detector
mastering_ros_demo_pkg
micros_mars_task_alloc
moveit_goal_builder
odometry_serialcom
orsens
phantomx_reactor_arm_controller
plot_util
pr2_delivery
pr2_tuck_arms_app
rail_face_detector
rail_object_detector
rangeonly_msgs
rapid_pbd
dynamic_map
riskrrt
robot_markers
rocon_iot_bridge
rocon_hue
rocon_ninjablock_bridge
rocon_smartthings_bridge
ros_ethernet_rmp
ros_package_web_server
rosprofiler
rosshell
rplidar_python
rqt_graphprofiler
rwt_config_generator
simple_voice
squirrel_hri_msgs
squirrel_object_perception_msgs
squirrel_speech_msgs
surface_perception
rviz_textured_quads
multicar_hydraulic
tinkerforge_laser_transform
tinycan
tork_rpc_util
transform_graph
tum_ardrone
uga_tum_ardrone
viodom

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged rospy at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.10.12
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/ros_comm.git
VCS Type git
VCS Version hydro-devel
Last Updated 2014-12-29
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

rospy is a pure Python client library for ROS. The rospy client API enables Python programmers to quickly interface with ROS

Additional Links

Maintainers

  • Dirk Thomas

Authors

  • Ken Conley
README
No README found. No README in repository either.
CHANGELOG

Changelog for package rospy

1.10.12 (2014-12-29)

  • fix infinitely retrying subscriber (#533)

1.10.11 (2014-08-18)

1.10.10 (2014-06-16)

1.10.3 (2014-06-02)

  • improve asynchonous publishing performance (#373)
  • allow custom error handlers for services (#375)

1.10.2 (2014-03-03)

  • fix exception handling for queued connections (#369)

1.10.1 (2014-02-25)

1.9.54 (2014-01-27)

1.9.53 (2014-01-14)

1.9.52 (2014-01-08)

1.9.51 (2014-01-07)

  • implement optional queueing for rospy publications (#169)
  • overwrite __repr__ for rospy.Duration and Time (ros/genpy#24)
  • add missing dependency on roscpp

1.9.50 (2013-10-04)

  • add support for python coverage tool to work in callbacks

1.9.49 (2013-09-16)

1.9.48 (2013-08-21)

  • make rospy nodes killable while waiting for master (#262)

1.9.47 (2013-07-03)

1.9.46 (2013-06-18)

1.9.45 (2013-06-06)

  • add missing run_depend on python-yaml
  • allow configuration of ports for XML RPCs and TCP ROS
  • fix race condition where rospy subscribers do not connect to all publisher
  • fix closing and deregistering connection when connect fails (#128)
  • fix log level of RosOutHandler (#210)

1.9.44 (2013-03-21)

1.9.43 (2013-03-13)

1.9.42 (2013-03-08)

  • make dependencies on rospy optional by refactoring RosStreamHandler to rosgraph (#179)

1.9.41 (2013-01-24)

1.9.40 (2013-01-13)

  • add colorization for rospy log output (#3691)
  • fix socket polling under Windows (#3959)

1.9.39 (2012-12-29)

  • first public release for Groovy

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
actionlib
app_manager
ar_track_alvar
arbotix_python
axis_camera
bondpy
calibration_estimation
camera_info_manager_py
capabilities
cob_command_gui
cob_dashboard
cob_script_server
cob_light
cob_phidgets
cob_sound
cob_voltage_control
cob_grasp_generation
cob_lookat_action
cob_moveit_interface
cob_pick_place_action
cob_tactiletools
cob_tray_monitor
cob_scan_unifier
diagnostic_aggregator
diagnostic_common_diagnostics
test_diagnostic_aggregator
dynamic_reconfigure
smach_ros
flir_ptu_driver
gazebo_plugins
tf2_py
tf2_ros
turtle_tf
turtle_tf2
camera_calibration
interactive_markers
ps3joy
wiimote
bayesian_belief_networks
chaplus_ros
gdrive_ros
google_chat_ros
julius_ros
pgm_learner
ros_google_cloud_language
rospatlite
rostwitter
switchbot_ros
webrtcvad_ros
dynamic_tf_publisher
jsk_network_tools
multi_map_server
jsk_tools
joy_mouse
pddl_planner
jsk_perception
sound_classification
jsk_interactive
jsk_interactive_test
kobuki_auto_docking
kobuki_node
kobuki_dashboard
kobuki_qtestsuite
map_laser
access_point_control
asmach_tutorials
ddwrt_access_point
hostapd_access_point
linksys_access_point
multi_interface_roam
network_monitor_udp
network_traffic_control
mavros
mongodb_log
mongodb_store
moveit_python
default_cfg_fkie
master_discovery_fkie
master_sync_fkie
node_manager_fkie
base_local_planner
fake_localization
map_server
move_base
range_sensor_layer
nmea_navsat_driver
nodelet
test_nodelet_topic_tools
novatel_span_driver
osm_cartography
route_network
face_detector
people_velocity_tracker
pr2_position_scripts
pr2_teleop
pr2_tuckarm
pr2_calibration_launch
pr2_dashboard_aggregator
joint_trajectory_action_tools
pr2_tuck_arms_action